Common Module |
![]() |
| AtmEarth | Earth atmospheric density |
| RFromCPAndGamma | Computes R from cP and gamma. |
| SimpAtm | Simplified atmosphere model. |
| StdAtm | Computes atmospheric density based on the standard atmosphere model. |
| ctranspose | Computes the transpose of a quaternion. |
| get | Gets the scalar and vector equivalent of a quat. |
| matrix | Returns a transformation matrix. |
| mtimes | Multiplies an object of type quat times a quaternion or a vector. |
| quat | Create an object of class quat. You can input: |
| scalar | Returns the scalar part of a quaternion. |
| vector | Returns the vector part of a quaternion. |
| and | Append two state space system |
| close | Close the loop on a statespace control system. |
| connect | Connection of two state space systems. |
| eig | Get the eigenvalues of a statespace system. |
| get | Get an element of the class statespace |
| getabcd | Get the state space matrices |
| getsub | Get a subset of state space matrices |
| isempty | Determine if x is an empty statespace system. |
| mtimes | Series connection of two state space systems. |
| plus | Parallel connection of two state space systems. |
| set | Set an element of the class statespace |
| statespace | Create a state space object. Everything after c is optional. |
| ctranspose | Computes the transpose of a matrix. |
| get | Gets the matrix equivalent of a transmat. |
| mtimes | Multiplies an object of type transmat times a transmat, quaternion or vector. |
| quaternion | Converts an input of type transmat to type quat. |
| transmat | Create an object of class transMat. |
| AtmData.txt | Data for the standard atmosphere |
| Constants.mat | Standard constants. |
| DoubleIntegrator.mat | Statespace model of a double integrator |
| Earth.mat | Low-res Earth texture map with clouds. |
| EarthMapData.mat | Data for generating Earth maps |
| ImageSCBus.mat | Sample spacecraft image with Earth background |
| KFSim.mat | Simulation data for use in Kalman filter demos |
| L1011 | L1011 aircraft state space model. |
| PSSLogo.tif | PSS Logo |
| Purr.mat | purr sound file |
| SampleSimOutput.txt | Default simulation output for use with QuickPlot. |
| Sosumi.mat | Sosumi sound file |
| SwooshWatermark.mat | Swoosh image for watermarking figures |
| TelemetryPages.mat | Sample telemetry page layout for demo |
| a.mat | Sample data for merging databases. |
| b.mat | Sample data for merging databases. |
| glass.mat | glass sound file |
| sphere.obj | OBJ file of a sphere for testing. |
| AggregateComponents | Aggregate CAD component vertices and faces. |
| Box | Generate a box centered at the origin. |
| BoxWithRoundedSection | Generate a box with a rounded section. |
| Cone | Compute the vertices for a cone. |
| CylinderWithHemisphere | Generates a cylinder with a hemisphere on one end instead of a flat disk. |
| Disk | Generate a disk. |
| Extrude | Generate an object from cross sections. |
| ExtrudeFromProfile | Extrude from a radial profile. |
| Frustrum | Generate a frustrum of a cone. |
| GeomPatch | Get vertices for surfaces of revolution, ellipsoids and cylinders |
| Icosahedron | Generate an icosahedron inscribed in a unit sphere. |
| MeshEllipsoid | Create a mesh ellipsoid. |
| OpenFrame | Generate an open frame |
| ParabolicReflector | Generate a parabolic reflector |
| PartialDisk | Generate vertices and faces for a full or partial disk |
| PlateTwoSided | Generate a plate in the xy plane. |
| Ring | Generate a ring with specified inner and outer wall, and length. |
| SectorPatch | Compute faces and vertices for a sector patch. |
| ShapedStrut | Generate strut going from x1 to x2. |
| Strut | Generate a variable radius strut going from x1 to x2. |
| Torus | Draws a torus |
| Triangle | Generate a solid triangle. |
| TriangularTruss | Generate a triangular truss going from x1 to x2. |
| Truss | Generate a square truss going from x1 to x2. |
| Tube | Generate a tube with specified inner and outer wall, and length. |
| TubeArc | Generate a portion of a tube with an inner and outer wall. |
| TubeSection | Generate a tube with specified inner and outer wall, and length. |
| TubeWithBends | Generate a tube with bends |
| Tubing | Generate a tube through the points p. |
| UChannel | Generate a box with a u cut at the +x end. |
| Wedge | Generate a wedge between x1 and x2. |
| ACTF | Generic sensor or actuator model. |
| Acker | Gains for poles using Ackermann's formula. |
| Alias | Computes the fundamental alias of a frequency. |
| AllanVariance | Implements the overlapping Allan Variance |
| Append | Appends two state space systems. |
| BalReal | Compute the balanced realization of a, b, c, d. |
| BalRealG | Computes a balanced realization of g. |
| BodeGP | Computes the phase using the Bode gain phase rule. |
| C2DFOH | Create a discrete time system using a first order hold. |
| C2DPulse | Create a discrete time system assuming a pulse at the input. |
| C2DZOH | Create a discrete time system using a zero order hold. |
| C2DZOHWD | Create a discrete time system using a zero order hold and delay. |
| C2DelZOH | Create a discrete time systems using the delta operator. |
| CButter | Create a continuous Butterworth Filter. |
| CCVModel | Generate CCV (control configured vehicle) aircraft model. |
| CGram | Compute the controllability gramian for a continuous time system. |
| CInputs | Generates different control inputs. |
| CLPoles | Computes the closed loop poles. |
| CLoopS | Creates a closed loop system. |
| CToD | Create a discrete time compensator from a continuous time compensator. |
| CToDRand | Convert continuous noise process to a discrete noise process. |
| CompE | Create a SISO compensator using a variety of compensator elements. |
| DBalReal | Compute a balanced realization for discrete time systems. |
| DBode | Generates a Bode plot for a discrete time system. |
| DCGain | Computes the DC gain of a discrete time state space system. |
| DCGram | Compute the controllability gramian for a discrete time system. |
| DOGram | Compute the observability gramian for a discrete time system. |
| DQCE | Create an optimal estimator. |
| DQCR | Create a quadratic regulator. |
| DRiccati | Solves the discrete matrix Riccati equation. |
| Delay | Create a model of a delay using Pade approximants for exp(-sT). |
| DigitalFilter | Implement a digital filter. |
| DispG | Display a statespace system using vertical bar charts. |
| ESAssign | Apply eigenvector and eigenvalue assignment. |
| ESAssignDraper | Apply eigenvector assignment using the Draper method. |
| EVAssgnC | Use eigenvector assignment to design a controller. |
| EVAssgnE | Use eigevector assignment to design an estimator. |
| EVDesMat | Create the design matrix for the eigenstructure assignment technique. |
| EigEval | Evaluate the eigenvalues and eigenvectors graphically. |
| FFTEngy | Plot the energy in a signal. |
| FOPID | Fractional order PID controller. |
| FResp | Compute the frequency response of the system given a, b, c and d. |
| FRespG | Compute the frequency response given the statespace class as input. |
| FRespPlot | Plot the frequency response of the system in Bode or Nichols form. |
| FindPeaks | Find peaks of the inputs by looking at slopes. |
| GND | Compute the frequency response given a numerator/denominator pair. |
| GPMargin | Computes gain and phase margins from magnitude and phase. |
| GSS | Compute the multivariable frequency response of the system. |
| Gen2nd | Creates a second order transfer function. |
| IC | Generate a response to an initial condition vector. |
| Integral | Creates a general integrator. |
| InvSys | Computes the inverse system. |
| JLQOF | Linear quadratic regulator with an output feedback cost function. |
| JLQTOF | Output feedback design with a reference input. |
| JLQTWOF | Output feedback design with a reference input. |
| KSmooth | Mechanizes a Kalman Filter fixed interval smoother. |
| KronProd | Compute the Kronecker product. |
| KronSum | Compute the Kronecker sum. |
| LFBal | Perform low frequency prebalancing of a system. |
| LQC | Design a quadratic controller. |
| LeadLag | Create a lead or lag. |
| Limit | Limits a matrix. |
| MSR | Mean squared response of a system. |
| MagPlot | Compute the magnitude frequency response of a system.s |
| ND2SS | Creates state-space model from numerator and denominator polynomials. |
| NLFilter | Implements a nonlinear fixed gain filter. |
| NQuant | Computes the variance for various types of roundoff. |
| Notch | Creates a second order transfer function. |
| NumericalTransferFunction | Computes a numerical transfer function from the impulse response. |
| Nyquist | Generate a Nyquist plot from a statespace object or gain/phase data. |
| OGram | Compute the observability gramian for a continuous time system. |
| P3Axis | A 3-axis proportional controller |
| PDDesign | Design a PD controller. |
| PGains | Compute the principal gains for a system. |
| PID | Design a PID controller. |
| PIDMIMO | Produces a state space n degree of freedom PID controller. |
| PIDProper | Compute proper and non-proper transfer functions for a PID. |
| PIDWithLag | Creates a PID controller with lag compensation. |
| PIDesign | Design a PI controller. |
| PILeaky | Design a leaky PI controller. |
| PWM | Create a model of a pulsewidth modulator using Padé approximants. |
| Parallel | Parallel connects two state space models. |
| PhasePlane | Implements a phase plane controller. |
| PhasePlanePlot | Plots a phase plane |
| PrintEigenvalues | Print eigenvalues to the command window. |
| PropStateSpace | Propagate a state space model. |
| QCE | Create an estimator from a state space system. |
| QCR | Creates a linear quadratic regulator from a state space system. |
| Quant | Quantizes a matrix using user defined rounding. |
| Riccati | Solves the matrix Riccati equation. |
| RootLocus | Generate the root locus for s SISO system. |
| RootSort | Sort columns of roots for Root Locus. |
| RouthArray | Computes the Routhian array for a polynomial. |
| S2Damp | Eigenvalues to damping and natural frequency. |
| S2Z | Transform an s-plane transfer function into the z-plane. |
| SRiccati | Solves the matrix Riccati equation |
| SS2ND | Converts from state space to numerator denominator form. |
| SSEmpty | Creates an empty state space system. |
| SSFromNonlinear | Computes state space matrices from a nonlinear function. |
| SVPlot | Computes the maximum and minimum singular values. |
| SelectS | Extract selected states from a state space model. |
| ShapeFlt | Generates a shaping filter with notches and first order roll off. |
| SizeAB | Checks the dimensions of the set a, b for consistency. |
| SizeABCD | Checks the dimensions of the set a,b,c,d for consistency. |
| SizeAC | Checks the dimensions of the set a, c for consistency. |
| StatePrp | Propagates state equations. |
| SteadyS | Determine the steady state control for a state space system. |
| Step | Generate a step response of a state space system. |
| TResp | Compute the time response of a state-space system. |
| TTPlots | Generates torque transmission plots. |
| TrnsZero | Computes the transmission zeros of a plant |
| WPZ | Frequency vector with complex poles and zeros. |
| WReson | Creates a frequency vector with points around resonances. |
| Windup | Implements anti windup compensation. |
| Z2Damp | Z domain to s domain damping and natural frequency. |
| Z2S | Transform an z-plane transfer function into the s-plane. |
| ZFresp | Generates the frequency response for a digital filter. |
| ZOH | Create a model of a zero-order-hold using Padé approximants. |
| AddOuterLoop | Add an outer loop for a controller. |
| AssembleBlock | Assemble a block given the data structure |
| AssemblePlant | Assemble a plant given a model described by gIn. |
| BlockDiagramPlugIn | Create a BlockDiagram GUI plug in. |
| ControlDesignGUI | Design control systems using a GUI. |
| DualListPlugIn | Create dual lists. |
| EigenstructurePlugIn | Create an Eigenstructure GUI plug in. |
| EmptyBlock | Produce an empty data structure used by the control functions |
| EmptySISO | Produce an empty data structure used by the control functions |
| LQPlugIn | Create an LQ plug in for the ControlDesignGUI. |
| MapIOPlugIn | Create an MapIO plug in for the ControlDesignGUI. |
| ModalReductionPlugIn | Create a ModalReduction plug in for the ControlDesignGUI. |
| ModalTransform | Transform the system a,b,c,d into modal form |
| ModelPlugIn | Create an Model GUI plug in. |
| ReduceModal | Retain modes k of the system a,b,c,d. |
| ReduceOrder | Retain states k of the system a,b,c,d |
| ReduceOrderPlugIn | Create a model order reduction GUI plug in. |
| SISOListPlugIn | Create a list of SISO elements for use by control design tools. |
| SISOPlugIn | Create an SISO GUI plug in. |
| AddOuterLoop | Add an outer loop for a controller. |
| AssembleBlock | Assemble a block given the data structure |
| AssemblePlant | Assemble a plant given a model described by gIn. |
| BlockDiagramPlugIn | Create a BlockDiagram GUI plug in. |
| ControlDesignGUI | Design control systems using a GUI. |
| DualListPlugIn | Create dual lists. |
| EigenstructurePlugIn | Create an Eigenstructure GUI plug in. |
| EmptyBlock | Produce an empty data structure used by the control functions |
| EmptySISO | Produce an empty data structure used by the control functions |
| LQPlugIn | Create an LQ plug in for the ControlDesignGUI. |
| MapIOPlugIn | Create an MapIO plug in for the ControlDesignGUI. |
| ModalReductionPlugIn | Create a ModalReduction plug in for the ControlDesignGUI. |
| ModalTransform | Transform the system a,b,c,d into modal form |
| ModelPlugIn | Create an Model GUI plug in. |
| ReduceModal | Retain modes k of the system a,b,c,d. |
| ReduceOrder | Retain states k of the system a,b,c,d |
| ReduceOrderPlugIn | Create a model order reduction GUI plug in. |
| SISOListPlugIn | Create a list of SISO elements for use by control design tools. |
| SISOPlugIn | Create an SISO GUI plug in. |
| BuildConstant | Build the constant database. |
| Constant | Outputs the value of a constant or opens a GUI for searching. |
| Database | GUI to output the value of a constant. q must be an exact match. |
| MergeConstantDB | Merges b into a using a GUI. The new file is saved as "NewDB.mat". |
| Sample.db | Sample database (text file with name/value/units). |
| DoubleIntegratorRHS | Right hand side for a double integrator. |
| FNLSpring | Nonlinear estimator spring model. Used by CDKFDemo. |
| GXUKF | A linear measurement. |
| HAngleUKF | Angle measurement from a fixed height object. |
| HNLSpring | Nonlinear estimator measurement spring model |
| MeasSpring | Spring measurement |
| OscillatorRHS | Right hand side for a spring. |
| RHS1D | Models a double integrator. |
| RHS1DWithAccel | Models a double integrator and a bias. |
| RHS1DWithAccelUKF | Models a double integrator and a bias. |
| RHSDoubleIntegrator | Right hand side for a double integrator. |
| RHSNLSpring | Nonlinear estimator spring model. |
| RHSOscillator | Right hand side for a spring. |
| RHSRBUKF | Right-hand-side for a rigid body. |
| RHSSpring | Computes the right hand side for a linear spring. |
| RHSUKF | Right-hand-side for a cubic spring. |
| RHSX | Right hand side for a one dimensional vertical motion simulation. |
| CCVDemo | Demonstrate eigenvector assignment using a CCV Model. |
| ControlExample | Put a series of compensators on a double integrator. |
| LQFullState | Demonstrate full state feedback. |
| MatchFilterTest | Test a match filter's ability to find a pulse. |
| ModelMatchingControl | Demonstrate model matching control using a single integrator plant. |
| PIDDemo | Compare the closed-loop response of a linear system |
| PWMVsZOH | Shows the difference between a PWM and a ZOH. |
| QCRDemo | Design and demonstrate a controller using QCR |
| SimpleControl | Simple controller. |
| TFiltRO | Demonstrates how to implement a digital filter. |
| TNoise | Designs noise filters and simulates them to show how they attenuate white noise. |
| TPID | PID Controller for a double integrator. |
| TPIDSat | Demonstrates the effect of integrator windup and how to fix it. |
| TSmooth | Demonstrate fixed interval smoothing using a Kalman Filter |
| OuterInnerTest | Inner/Outer control loop test. |
| OuterInnerTest | Inner/Outer control loop test. |
| TConstant | Demonstrate the Constant database. |
| UIElementDemo | Demonstrate UIElement and other controls. |
| CDKFDemo | Demonstrate the continuous discrete iterated Kalman Filter. |
| EKFNLSpring | Extended Kalman filter for a nonlinear spring. |
| IMMDemo | IMM test using a Continuous Wiener process acceleration (CWPA) model. |
| KFFrequencyResponse | Frequency response for a Kalman filter with an oscillator as the model. |
| KFNLSpring | Discrete time Kalman filter for a nonlinear spring. |
| NLSpringSim | Nonlinear estimator spring simulation. |
| SimpleKalmanFilter | Discrete time Kalman filter |
| UDKFDemo | Demonstrate the Kalman Filter using UD factorization. |
| UKFAndEKFNLSpring | Simulate a UKF and EKF with a nonlinear spring example. |
| UKFNLSpring | Unscented Kalman filter for a nonlinear spring. |
| UKFPDemoLinearSpring | Demonstrate UKF parameter estimation with a nonlinear spring example. |
| CDKFDemo | Demonstrate the continuous discrete iterated Kalman Filter. |
| EKFNLSpring | Extended Kalman filter for a nonlinear spring. |
| IMMDemo | IMM test using a Continuous Wiener process acceleration (CWPA) model. |
| KFFrequencyResponse | Frequency response for a Kalman filter with an oscillator as the model. |
| KFNLSpring | Discrete time Kalman filter for a nonlinear spring. |
| NLSpringSim | Nonlinear estimator spring simulation. |
| SimpleKalmanFilter | Discrete time Kalman filter |
| UDKFDemo | Demonstrate the Kalman Filter using UD factorization. |
| UKFAndEKFNLSpring | Simulate a UKF and EKF with a nonlinear spring example. |
| UKFNLSpring | Unscented Kalman filter for a nonlinear spring. |
| UKFPDemoLinearSpring | Demonstrate UKF parameter estimation with a nonlinear spring example. |
| AnimationDemo | Visualization and animation of 3D vector data |
| ColorFunctionsDemo | Examples of generating colors for plots |
| DemoRealTimePlot | Demonstrate real-time plots |
| Plotting2DDemo | Examples of 2D plotting in the toolbox |
| TimeGUIDemo | Demonstrates the TimeGUI plugin in a loop. |
| FileHelpDemo | Demonstrate the online file help |
| TelemetryDemo | Telemetry Demo |
| Rover1D | A UKF for estimating position, velocity and accelerometer bias. |
| UKFDemoNLSpring | Simulate a UKF with a nonlinear spring example. |
| UKFPDemoNLSpring | Demonstrate UKF parameter estimation with a nonlinear spring example. |
| UKFPDemoRigidBody | Demonstrate UKF parameter estimation with a rigid body. |
| UKFSmootherDemo | Demo of Rauch-Tung-Striebel smoothing for an Unscented Kalman Filter. |
| AngleSensor | Angle sensor. |
| CDKF | Continuous discrete iterated extended Kalman Filter. |
| CWPAModel | Continuous Wiener process acceleration (CWPA) model. |
| EKFPredict | Extended Kalman Filter prediction step. |
| EKFUpdate | Extended Kalman Filter measurement update step. |
| FXNLSpring | Jacobian of RHSUKF. |
| IEKFUpdate | Iterated Extended Kalman Filter measurement update step. |
| IMMPredict | Interactive Multiple Models prediction step. |
| IMMUpdate | Interactive Multiple Models update step. |
| KFInitialize | Initializes Kalman Filter data structures for the KF, UKF, EKF and IEKF. |
| KFPredict | Linear Kalman Filter prediction step. |
| KFUpdate | Linear Kalman Filter measurement update step. |
| KFilter | Mechanizes one step of a Kalman Filter with a forgetting factor |
| KalmanFilterCombine | Combine forward and backward covariances and states. |
| MeasNLSpring | Computes nonlinear spring measurement |
| MeasPartialNLSpring | Computes nonlinear spring measurement partial derivative |
| RHSPartialNLSpring | Nonlinear estimator spring model. |
| RTSS | Rauch-Tung-Striebel smoothing |
| SigmaPointsChol | UKF sigma points using chol. |
| Symmetrize | Makes a square matrix symmetric by adding its transpose and dividing |
| UDKalmanFilter | Implements a Kalman filter using UD factorization. |
| UKF | Implement an Unscented Kalman Filter. |
| UKFP | Implement an Unscented Kalman Filter for parameter estimation. |
| UKFPredict | Unscented Kalman Filter state prediction step. |
| UKFRTSS | Rauch-Tung-Striebel smoothing for an Unscented Kalman Filter. |
| UKFUT | Unscented Kalman Filter transform. |
| UKFUpdate | Unscented Kalman Filter measurement update step. |
| UKFWeight | Unscented Kalman Filter weights. |
| UKUDF | Implement an Unscented Kalman Filter in UD (upper diagonal) form. |
| DateChanged | Find a list of files in the directory who have been modified after |
| FileFullpath | Save the file at the path of the calling function. |
| FindDirectory | Returns the path to a directory. |
| FindInFiles | Find all files that contain a specified string. |
| FindRequiredFiles | Find the files required by a function or a script in order to run |
| FindStringInFiles | Finds all instances of the string z in directory d. |
| FirstLineOfCode | Return the first line of code for a m-file. |
| FixLineEndings | Make line endings consistent with the platform. |
| GetFileRoot | Get the root name of a file (without the .xxx) |
| GetFileSuffix | Get the suffix of a file, i.e. the xxx of yyyyy.xxx. |
| GetHeaders | Finds all files in the directory d. |
| GetModificationDate | Gets the modification date. |
| IsFunction | Determine whether a file is a function or script. |
| OpenFile | Open a file using a GUI if it is not specified. |
| PathDirectories | Generate a cell array list of all directories in the Matlab path. |
| RemoveContentsFile | Removes the 'Contents.m' file from a cell array of file names |
| EditDlg | Creates a dialog which requires a string as an answer. |
| Figui | User-interface to manage figure windows. |
| Finder | GUI to find occurrences of a text string in m-files on your MATLAB path. |
| GUIColors | GUI for setting interface colors. |
| GUIColors.mat | Saved interface colors data. |
| InformDlg | Create an information dialog that will be dismissed by a script. |
| LegendFig | Produce a new figure with just a legend of colors and names. |
| MLog | Message log. Keeps an ordered, scrollable set of messages. |
| MessageQueue | Creates a message queue GUI. Once opened, it stays open. |
| ODETimeDisplay | Displays an estimate of time to go, compatible with ode113. |
| Selection | Selection GUI. |
| SetCopy | Set the dimensions of the figure when copied or printed. |
| StopGUI | GUI for stopping scripts. Has Pause, Stop, and Plot buttons. |
| TabBox | Create a tab box from plug-ins. |
| TimeCntrl | Perform actions specified by the time display. |
| TimeDisplay | Displays a simple estimate of time to go (no controls). |
| TimeGUI | A GUI displaying the time remaining and estimated completion time. |
| TimeToGo | Computes the time left to go in the simulation, the predicted finish |
| AddToList | Add an item to a uicontrol listbox. |
| AddToPath | Add a local directory to the path and return to the current directory. |
| AllCaps | Determines if the string is all capital letters. |
| ArrayToLinspace | Converts an array a s function string. |
| AssignFHandle | Assign either a string or function handle depending on the MATLAB version. |
| CPIAdjust | Consumer Price Index adjustment. |
| Cell2DToStruct | Convert a structure into a cell array where columns of the array |
| CellToMat | Converts a cell array to a matrix. |
| CenterFigure | Find a position array that centers a figure |
| ChangePath | Change the path |
| CloseFigure | Close a figure |
| CloseIfHandle | Close h if it is a handle to a figure. |
| CloseMatFile | Closes every file not listed in kOpenPre. |
| CloseUIElement | Close a UIElement. |
| ColumnSizeCellArray | Outputs the size of each column of a cell array. |
| ConvertFortranFormatToC | Convert Fortran formats to C. Specifically A, I, D, E, F are converted. |
| CreateHTMLTable | Creates an HTML table from x. |
| CreateLatexTable | Creates a LaTeX table from x. |
| CreateTable | Creates a table from x for displaying to the command line. |
| DeBlankAll | Delete all blanks |
| DeBlankLT | Delete leading and trailing blanks. |
| DebugLog | Display a message to help debugging. |
| DeleteCell | Delete a cell element of a one dimensional cell array. |
| DeleteFromList | Delete the selected item from a list. |
| DeleteIfHandle | Close h if it is a handle |
| DeleteSuffix | Deletes the .xxx part of a name. |
| DirToCell | Converts a directory list into a cell array. |
| DispWithTitle | Display a variable with a title. |
| DisplayLatexTable | Displays a LaTeX table or create formatted string output. |
| EditScroll | Implement a scrollable edit window |
| Equal | Returns one if a and b are identical. |
| FSWClock | This routine implements the flight software clock. |
| Fractal | Generates fractals. |
| FunNames | Get Function Names |
| GetCurrentGUIObject | Gets the last uicontrol that was hit. |
| GetEntry | Gets the input from a vector of graphics handles and determines |
| GetInputFromString | Generates an output from a string. |
| GetListString | Get an element from a list uicontrol. |
| GetNewTag | Get a new tag to uniquely identify a figure. |
| GetUIElement | Get certain properties of UIElements. |
| HasOptimizationToolbox | Returns 1 if a licensed optimization toolbox is in your path |
| Inflation | Computes U.S. inflation. |
| IntToBinary | Converts an integer to binary [lsb msb] in two's complement. |
| IsValidField | Determine if a field exists and is not empty. |
| IsVersionAfter | Checks to see if the version of MATLAB is after n |
| IsVersionBefore | Checks to see if the version of Matlab is before n |
| LatexExp | Creates a latex exponential string |
| LatexScientificNotation | Converts a number into a string using latex notation. |
| LatexTableFromStructure | Creates a LaTeX table from s. |
| ListCases | List the switch cases that are included in a given file. |
| ListFunctions | List the functions that are called from a given file. |
| ListMemberFunctions | List the member functions that are included in a given function/file. |
| ListParents | List all parents of a function. Search inside given folder. |
| LogB | Log base b |
| MatToCell | Converts a string matrix to a cell array. |
| MatrixCellTo3D | Convert a cell array of p x p matrices into a 3D matrix. |
| MatrixDisplay | Display a matrix using the format f |
| Num2Str1Line | Converts a matrix to a one line string. |
| PrintTitle | Print a title with --- under and above. |
| ProcessTag | Code used to process tags for sensors and actuators. |
| RadioButtons | Create radio buttons. |
| RequiredFields | Returns 1 if the data structure g has the required fields in r |
| SaveMovie | Save a MATLAB movie. |
| SaveStructure | Save a structure in a file. You will be able to read it in by typing |
| SetUIElement | Set certain properties of UIElements |
| SortColumnCell | Sort a nxm cell array by the values in the first column. |
| Staircase | Generates steps for any number of inputs. Since version 10. |
| StrMtch | In a matrix with each row a string finds the first matching string. |
| StringMatch | Finds which elements of sA match s |
| StringToToken | Finds the first token in a string |
| StringToTokens | Converts a string to a list of tokens. |
| StructToCell2D | Convert a structure into a cell array. |
| StructToText | Write data structure to a text file or command line display. |
| StructureList | Creates a list of structures and variables. |
| UIElement | Interface to PSS and Mathworks UI. |
| ValidTime | Returns the time if valid. |
| WaitBarManager | Manages the wait bar. |
| Watermark | Add a watermark to a figure. |
| fixpopupuicontrol | This function found on Mathworks website as a bug-fix for MATLAB 7. |
| flength | Give the length of a file in bytes. |
| AddAxes | Adds x,y,z coordinate axes to a figure. |
| AddDeltaModeToPlot | Add mode changes to a plot. |
| AddFillToPlots | Find mode changes in data and draw as filled sections on existing plots. |
| AddPlot | Add a plot to the current axis of a plot page. |
| AddView | Add view accelerators to a figure. |
| AddZoom | Add zoom-in (CTRL+I) and zoom-out (CTRL+O) accelerators to a figure. |
| AnglePatch | Draw a patch showing the inner angle between two vectors. |
| AnimateCube | Draw a cube given its dimensions. |
| AnimateVectors | Animate one or more time-varying vectors. |
| Animator | Animate a set of 2xN or 3xN matrices over N steps. |
| Arrow3D | Draws a 3D arrow into an existing figure |
| AssignColors | Choose n colors from around the RGB color wheel. |
| AttitudeCoordinates | Draw attitude coordinates. |
| AxesCart | Draw axes on the current plot with X, Y, Z, text labels. |
| Axis3D | Adjust 3D axes properties. |
| AxisEqual | Equalize the axes with a minimum relative size for the smallest axis. |
| BarPlot | Creates a bar plot of x. |
| CameraControls | This function creates a GUI for manipulating the camera view. |
| Centroid | Compute a centroid from a set of vertices. |
| Circle | Compute x y data for a 2-D Circle. |
| ColorMapGrayScale | Generates a gray scale colormap with 256 entries. |
| ColorSpread | Produce a set of 3-element RGB colors that spread across the colormap. |
| ConvertOBJFileColorToMatlab | Converts the Wavefront OBJ color format to MATLAB. |
| Coordinates | Creates a figure with x,y,z coordinates at the origin. |
| DiskWithHole | Draw a disk. |
| DistanceLabel | Rescales distances and produce labels |
| DrawCAD | Draw a CAD model stored in the toolbox CAD format. |
| DrawFOV | Draw fields of view. |
| DrawImage | Draws an image in a figure window |
| DrawSphere | Draw a sphere with specified latitude and longitude lines. |
| DrawTreeDiagram | Creates and draws a tree diagram. |
| DrawVertices | Draw an object from vertices with in a figure using patch, using lighting. |
| Ellipsd | Generates an ellipsoid using the equation |
| GPoly | Graphical interface to create a polygon. |
| ImageOverlay | This function displays an image file and overlays text boxes. |
| IntersectPlaneAndSphere | Finds the vector giving the intersection |
| LabelLine | Labels a line. |
| LabelS | Creates 2 or 3 axis labels |
| LegendTitle | Add a title to the current legend. |
| LegendWithTitle | Create a legend with a title. |
| Loc3D | Plot the location of points |
| LogLimit | Given a frequency vector, find the logarithm of the frequency |
| Map | Draws a 2 or 3 dimensional map of a planet. |
| Mesh2 | Draws mesh plots with axis labels. |
| Mesh3DMF | Generate a 3DMF file for a mesh. This function will append ".t3d" to the file. |
| MeshSOR | Create a polygonal mesh from a surface of revolution. |
| MeshToPatch | Convert a mesh to a patch. |
| NPlot | NPlot generates a plot on which the ylabels are character strings. |
| NewFig | Creates a new figure. |
| Normal | Compute a normal from a set of vertices using the Newell method. |
| PlaybackControls | Create a GUI with playback controls. |
| Plot2D | Easily build a versatile 2D plot page consisting of any number of plots. |
| Plot3D | Create a 3-dimensional plot. |
| Plot3Vector | Plot a 3 vector as x, y, z subplots as well as a combined plot. |
| PlotAngleRange | Plot one or more angular ranges on a unit circle |
| PlotArrays | Manage a set of arrays for plotting simulation data. |
| PlotColor | Generate [r, g, b] for an index k = 1 to 100. |
| PlotDoubleYAxis | Generates a plot with two y axes. |
| PlotF | Create any number of plot pages in one call. Utilizes Plot2D. |
| PlotSet | Create two-dimensional plots from a data set. |
| PlotV | Draws plots of a set of 3*m-by-n vectors in 3D axes. |
| PltStyle | Edit this to globally change the plot styles for the plot labels |
| Polygon | Generate the properties for a polygon given vertices in the form v(3,n). |
| PolygonProps | Polygon properties from vertex and face data. |
| PositionLabel | With an input in meters give a reasonable output scale |
| PrintFig | Prints specified figures to a printer or files. |
| RealTimePlot | Plot real time |
| Rename | Renames a figure title. |
| SetFont | Sets default fonts |
| ShowThreeImages | Display three images |
| SliderBar | Create a slider in a new figure with continuous calls to callback. |
| SortFigs | Sort figure windows by cascading them. |
| Splash | Draw a splash screen. |
| StateDisplay | Draw a 3D covariance display in real-time. |
| Sweep | Sweep a 2D outline around the z-axis to obtain vertices and faces. |
| TextInBox | Draw text in a box |
| TextS | Prints labels on a graph using text with toolbox style settings. |
| TimeHistory | Time history plots |
| TimeLabel | Produce time labels and scaled time vectors |
| TimeLabl | Generates a time label given the maximum value of t and rescales t. |
| TitleS | Creates a title using the toolbox style settings. |
| TreeDiagram | Generates a tree diagram. |
| VantagePoint | Adds vantage points to an existing plot. |
| VelocityLabel | With an input in meters/s give a reasonable output scale |
| View3D | View a plane of a 3D plot or standard cartesian view. |
| XLabelS | Creates an xlabel using the toolbox style settings |
| YLabelS | Creates a ylabel using the toolbox style settings |
| ZLabelS | Creates a zlabel using the toolbox style settings |
| ExportToPSSMatrix | Export two dimensional matrices to a file that can be read by pss_matrix. |
| LoadSimLog | Reads data from a simulation log file. |
| QuickPlot | Plots output data from external simulations. |
| ReadCSVTable | Read in tabular data in .csv file and convert it to a structure array. |
| SFunc | An example s-function that interfaces mfiles to Simulink. |
| STKAtt | Prints attitude data to STK-formatted file |
| STKOrbit | Prints orbit data to STK-formatted file. |
| VCFlatFile | Write a set of variables to a VC flat file (comma-separated with header). |
| WriteCM | Write a matrix for use in a C or C++ program. |
| AddMass | Add mass properties. |
| IC623X3 | Convert an inertia matrix from a 1x6 to a 3x3 format. |
| InertiaChain | Computes inertia and center of mass for a chain of bodies |
| InertiaFromOBJFile | Computes an inertia matrix from an obj file or data structure. |
| Inertias | Computes inertias of common objects about their c.m. |
| MassProp | Compute inertia, mass and center of mass for a collection of rigid bodies. |
| MassPropertiesSolidObjFile | Computes a mass properties data structure from an obj file. |
| MassPropertiesTetrahedron | Compute inertia, volume and center of mass of a uniform tetrahedron. |
| MassStructure | Create a mass data structure. |
| PrincipalAxes | Computes the principal axes for an inertia matrix. |
| VFToMassStructure | Computes mass properties for a component defined by vertices and faces. |
| Volumes | Computes volumes of common objects about their c.m. |
| AtomicMass | Outputs atomic mass in kg or amu. |
| CPGas | Thermal capacity for a gas as a function of temperature. |
| GasProperties | Returns gas properties. |
| LiquidMetalProps | Liquid metal thermal properties |
| PoissonsRatio | Returns Poisson's ratio. |
| ComputeGainsPlugIn | Create a detection filter gains GUI plug in used by DetectionFilterBuilder. |
| HierarchicalListPlugIn | Create and manages a hierarchical list. Each element of the list is |
| NormalizePlugIn | Create the Normalize GUI plug in used by DetectionFilterBuilder. |
| PlotPlugIn | Plot a variable number of points. The function is called as: |
| SimulatePlugIn | Create a Simulate GUI plug in used by DetectionFilterBuilder. |
| StateSpacePlugIn | Create an StateSpace GUI plug in used by DetectionFilterBuilder. |
| Telemetry | Generates a GUI with a set of telemetry pages. |
| TelemetryOffline | This GUI plots telemetry files previously saved by Telemetry. |
| TelemetryPlot | Plot real time data in a single window. |
| TimePlugIn | Create a time GUI plug in. |
| HoopStress | Computes the thickness of a pressure vessel. |
| MassPressureVessel | Computes the mass of a pressure vessel. |
| WallThicknessCone | Wall thickness of a cone from pressure and material strength |
| AU2Q | Convert an angle and a unit vector to a quaternion. |
| Anim2Q | Animate the evolution of 2 quaternions over time. |
| AnimQ | Animate the evolution of a quaternion over time. |
| DQ2Mat | Finds the derivative of a transformation matrix in terms of quaternions |
| DeltaQToRate | Angular rate from small quaternion changes. |
| Eul2Q | Converts 3-2-1 Euler angles to a quaternion |
| Mat2Q | Converts a transformation matrix to a quaternion. |
| Q2AU | Convert a quaternion to an angle and a unit vector. |
| Q2Eul | Converts a quaternion to 3-2-1 Euler angles. |
| Q2Mat | Converts a quaternion to a transformation matrix. |
| QAxisRot | Creates a quaternion based on a pure rotation about the any axis. |
| QBToIDot | Computes the quaternion derivative from angular velocity. |
| QError | Small angle errors between two quaternions. |
| QForm | Transforms a vector in the direction of the quaternion. |
| QFromDQ | Computes a quaternion from a base quaternion and delta quaternion. |
| QMult | Multiply two quaternions. |
| QPose | Transpose of a quaternion. |
| QRand | Generates random quaternions. |
| QTForm | Transforms a vector opposite the direction of the quaternion. |
| QUnit | Unitizes a quaternion. |
| QZero | Outputs the zero quaternion, [1;0;0;0] |
| Sa2Q | Converts an angle vector into a quaternion. |
| U2Q | Finds the quaternion that aligns a unit vector with a second vector. |
| ReliabilityMOfN | Determine the reliability of a system |
| ReliabilityParallel | Determine the reliability of a parallel system |
| ReliabilitySeries | Determine the reliability of a series system |
| DN2Date | Computes the date from the day number and year. January 1 is day 1. |
| DN2JD | Computes the Julian Date from the day number and year. |
| DNString2Date | Converts a day number string to a date. |
| DTAToDTS | Converts the date time array to the date time structure |
| DTSToDTA | Converts the date time structure to the date time array |
| Date2DN | Compute the day number from the date. Uses the format from clock. |
| Date2FY | Computes the fractional year from the date. |
| Date2JD | Compute the Julian Date from the date. |
| DateStringToJD | Convert a date string to Julian date. |
| DeltaT | Computes the difference between UT1 and TT based on the Julian date. |
| FindSolsticeOrEquinox | Finds the Julian Date for solstices and equinoxes. |
| JD2000 | Returns the Julian Date for J2000.0 0d 0h UT |
| JD2Array | Compute an array of Julian dates from an epoch. |
| JD2DN | Compute the day number from Julian date. |
| JD2Date | Compute the calendar date from the Julian date. |
| JD2Day | Computes the day of the week from Julian day number. |
| JD2MJD | Converts Julian date to Modified Julian Date |
| JD2T | Converts Julian days to centuries from J2000.0 |
| JDToDateString | Convert Julian Date to the form '04/20/2000 00:00:00' |
| JDToMidnight | Converts a Julian date to the nearest midnight. |
| LeapYear | Determines if a year is a leap year |
| LocalTimeToGMT | Compute the Julian Date from the local time. |
| LocalTimeToJD | Compute the Julian Date from the local time. |
| MJD2JD | Converts Modified Julian Date to Julian date. |
| SecToString | Convert seconds to days hours/min/seconds and produces a string. |
| SystemTime | Provides the system time to the software. |
| T2JD | Converts Julian centuries from J2000.0 to days |
| TAI2TT | Converts Terrestrial atomic time to Terrestrial dynamic time |
| TDB2TT | Converts barycentric dynamical time |
| TT2TAI | Converts Terrestrial (dynamic) time to Terrestrial atomic time |
| TT2TDB | Converts terrestrial dynamic time to barycentric dynamical time. |
| TT2UT1 | Converts TT (Terrestrial (dynamic) Time) to UT1 |
| TimeStringToJD | Convert a time string to Julian date. The time string |
| UT12TT | Converts UT1 (time scale based on the rotation of the earth) |
| YPF2T | Converts years in fractional form, e.g. 1993.5 to T |
| AU2M | Convert an angle and a unit vector to a matrix. |
| Altitude | Computes the altitude above an ellipsoidal planet. |
| Cart2Sph | Converts cartesian coordinates to spherical. |
| CoordinateFrameFromUV | Computes a transformation matrix from the frame |
| DMS2Deg | Convert degrees, minutes and seconds to radians |
| DMS2Rad | Convert degrees, minutes and seconds to radians. |
| Deg2DMS | Convert degrees to degrees, minutes and seconds. |
| Deg2HMS | Convert radians to hours, minutes and seconds |
| Eul2Mat | Converts 3-2-1 Euler angles into an orthonormal transformation matrix. |
| EulDot2Rates | Converts 3-2-1 Euler angle rates into angular velocity. |
| HMS2Deg | Convert hours, minutes and seconds to degrees. |
| HMS2Rad | Convert hours, minutes and seconds to radians. |
| IConv | Transform a 6x1 compact inertia vector into a 3x3 inertia matrix. |
| IConvP | Transform a a 3x3 inertia matrix into 6x1 compact inertia vector. |
| Mat2Eul | Converts an orthonormal transformation matrix into 3-2-1 Euler angles. |
| RPhiTheta2Cart | Computes the transformation matrix from an r, phi, theta frame |
| RaDec2U | Converts right ascension and declination to unit vectors. |
| Rad2DMS | Convert radians to degrees, minutes and seconds |
| Rad2HMS | Convert radians to hours, minutes and seconds |
| Rates2EulDot | Converts angular velocity into 3-2-1 Euler angle rates. If only one |
| RotMat | Generates a rotation matrix that transforms in the opposite direction |
| Sph2Cart | Converts spherical coordinates to cartesian. |
| TranslateAxes | Recompute the moment of inertia "i" by translating axes. |
| UnitVectorFromOffset | Computes a unit vector offset from v2 with origin at v1. |
| VM2Int | Converts apparent visual magnitude to intensity in watts/m^2. |
Back to Functions main page