matlab机器人工具箱matlabrobotics_toolbox_demo(共5则范文)

时间:2019-05-15 03:47:29下载本文作者:会员上传
简介:写写帮文库小编为你整理了多篇相关的《matlab机器人工具箱matlabrobotics_toolbox_demo(共)》,但愿对你工作学习有帮助,当然你在写写帮文库还可以找到更多《matlab机器人工具箱matlabrobotics_toolbox_demo(共)》。

第一篇:matlab机器人工具箱matlabrobotics_toolbox_demo(共)

MATLAB ROBOTTOOL

rtdemo演示

目录

一、rtdemo机器人工具箱演示..............................................2

二、transfermations坐标转换.................................................2

三、Trajectory齐次方程..........................................................8

四、forward kinematics 运动学正解.....................................12

四、Animation 动画..............................................................18

五、Inverse Kinematics运动学逆解......................................23

六、Jacobians雅可比---矩阵与速度...................................32

七、Inverse Dynamics逆向动力学........................................45

八、Forward Dynamics正向动力学.......................................52

一、rtdemo机器人工具箱演示 >> rtdemo %

二、transfermations坐标转换

% In the field of robotics there are many possible ways of representing

% positions and orientations, but the homogeneous transformation is well

% matched to MATLABs powerful tools for matrix manipulation.% % Homogeneous transformations describe the relationships between Cartesian

% coordinate frames in terms of translation and orientation.% A pure translation of 0.5m in the X direction is represented by

transl(0.5, 0.0, 0.0)ans =

1.0000

0

0

0.5000

0

1.0000

0

0

0

0

1.0000

0

0

0

0

1.0000 % % a rotation of 90degrees about the Y axis by

roty(pi/2)ans =

0.0000

0

1.0000

0

0

1.0000

0

0

-1.0000

0

0.0000

0

0

0

0

1.0000 % % and a rotation of-90degrees about the Z axis by

rotz(-pi/2)ans =

0.0000

1.0000

0

0

-1.0000

0.0000

0

0

0

0

1.0000

0

0

0

0

1.0000 % % these may be concatenated by multiplication

t = transl(0.5, 0.0, 0.0)* roty(pi/2)* rotz(-pi/2)t =

0.0000

0.0000

1.0000

0.5000

-1.0000

0.0000

0

0

-0.0000

-1.0000

0.0000

0

0

0

0

1.0000

% % If this transformation represented the origin of a new coordinate frame with respect % to the world frame origin(0, 0, 0), that new origin would be given by

t * [0 0 0 1]' ans =

0.5000

0

0

1.0000

pause % any key to continue % % the orientation of the new coordinate frame may be expressed in terms of % Euler angles

tr2eul(t)ans =

0

1.5708

-1.5708 % % or roll/pitch/yaw angles

tr2rpy(t)ans =

-1.5708

0.0000

-1.5708

pause % any key to continue % % It is important to note that tranform multiplication is in general not

% commutative as shown by the following example

rotx(pi/2)* rotz(-pi/8)ans =

0.9239

0.3827

0

0

-0.0000

0.0000

-1.0000

0

-0.3827

0.9239

0.0000

0

0

0

0

rotz(-pi/8)* rotx(pi/2)ans =

0.9239

0.0000

-0.3827

-0.3827

0.0000

-0.9239

0

1.0000

0.0000

0

0

0

% % pause % any key to continue echo off

1.0000

0

0

0 1.0000

三、Trajectory齐次方程

% The path will move the robot from its zero angle pose to the upright(or % READY)pose.% % First create a time vector, completing the motion in 2 seconds with a % sample interval of 56ms.t = [0:.056:2];pause % hit any key to continue % % A polynomial trajectory between the 2 poses is computed using jtraj()%

q = jtraj(qz, qr, t);pause % hit any key to continue % % For this particular trajectory most of the motion is done by joints 2 and 3, % and this can be conveniently plotted using standard MATLAB operations

subplot(2,1,1)

plot(t,q(:,2))

title('Theta')

xlabel('Time(s)');

ylabel('Joint 2(rad)')

subplot(2,1,2)

plot(t,q(:,3))

xlabel('Time(s)');

ylabel('Joint 3(rad)')

pause % hit any key to continue

% % We can also look at the velocity and acceleration profiles.We could

% differentiate the angle trajectory using diff(), but more accurate results

% can be obtained by requesting that jtraj()return angular velocity and

% acceleration as follows

[q,qd,qdd] = jtraj(qz, qr, t);% % which can then be plotted as before

subplot(2,1,1)

plot(t,qd(:,2))

title('Velocity')

xlabel('Time(s)');

ylabel('Joint 2 vel(rad/s)')

subplot(2,1,2)

plot(t,qd(:,3))

xlabel('Time(s)');

ylabel('Joint 3 vel(rad/s)')pause(2)

% and the joint acceleration profiles

subplot(2,1,1)

plot(t,qdd(:,2))

title('Acceleration')

xlabel('Time(s)');

ylabel('Joint 2 accel(rad/s2)')

subplot(2,1,2)

plot(t,qdd(:,3))

xlabel('Time(s)');

ylabel('Joint 3 accel(rad/s2)')pause % any key to continue

echo off

四、forward kinematics 运动学正解

% Forward kinematics is the problem of solving the Cartesian position and

% orientation of a mechanism given knowledge of the kinematic structure and % the joint coordinates.% % Consider the Puma 560 example again, and the joint coordinates of zero, % which are defined by qz

qz qz =

0

0

0

0

0

0 % % The forward kinematics may be computed using fkine()with an appropropriate

% kinematic description, in this case, the matrix p560 which defines

% kinematics for the 6-axis Puma 560.fkine(p560, qz)ans =

1.0000

0

0

0.4521

0

1.0000

0

-0.1500

0

0

1.0000

0.4318

0

0

0

1.0000 % % returns the homogeneous transform corresponding to the last link of the % manipulator pause % any key to continue % % fkine()can also be used with a time sequence of joint coordinates, or

% trajectory, which is generated by jtraj()%

t = [0:.056:2];% generate a time vector

q = jtraj(qz, qr, t);% compute the joint coordinate trajectory % % then the homogeneous transform for each set of joint coordinates is given by

T = fkine(p560, q);% % where T is a 3-dimensional matrix, the first two dimensions are a 4x4

% homogeneous transformation and the third dimension is time.% % For example, the first point is

T(:,:,1)ans =

1.0000

0

0

1.0000

0

0

0

0 % % and the tenth point is

T(:,:,10)ans =

1.0000

-0.0000

-0.0000

1.0000

0

0

0

0

0

0

0

0

0

0 0.4521-0.1500 0.4318

1.0000 0.4455-0.1500 0.5068

1.0000

1.0000

1.0000

pause % any key to continue % % Elements(1:3,4)correspond to the X, Y and Z coordinates respectively, and

% may be plotted against time

subplot(3,1,1)

plot(t, squeeze(T(1,4,:)))

xlabel('Time(s)');

ylabel('X(m)')

subplot(3,1,2)

plot(t, squeeze(T(2,4,:)))

xlabel('Time(s)');

ylabel('Y(m)')

subplot(3,1,3)

plot(t, squeeze(T(3,4,:)))

xlabel('Time(s)');

ylabel('Z(m)')pause % any key to continue %

% or we could plot X against Z to get some idea of the Cartesian path followed % by the manipulator.%

subplot(1,1,1)

plot(squeeze(T(1,4,:)), squeeze(T(3,4,:)));

xlabel('X(m)')

ylabel('Z(m)')

grid pause % any key to continue

echo off

四、Animation 动画 clf % % The trajectory demonstration has shown how a joint coordinate trajectory % may be generated

t = [0:.056:2]';% generate a time vector

q = jtraj(qz, qr, t);% generate joint coordinate trajectory %

% the overloaded function plot()animates a stick figure robot moving

% along a trajectory.plot(p560, q);% The drawn line segments do not necessarily correspond to robot links, but

% join the origins of sequential link coordinate frames.% % A small right-angle coordinate frame is drawn on the end of the robot to show % the wrist orientation.% % A shadow appears on the ground which helps to give some better idea of the % 3D object.pause % any key to continue

% % We can also place additional robots into a figure.% % Let's make a clone of the Puma robot, but change its name and base location

p560_2 = p560;

p560_2.name = 'another Puma';

p560_2.base = transl(-0.5, 0.5, 0);

hold on

plot(p560_2, q);pause % any key to continue

% We can also have multiple views of the same robot

clf

plot(p560, qr);

figure

plot(p560, qr);

view(40,50)

plot(p560, q)pause % any key to continue

% % Sometimes it's useful to be able to manually drive the robot around to % get an understanding of how it works.drivebot(p560)%

% use the sliders to control the robot(in fact both views).Hit the red quit % button when you are done.echo off

五、Inverse Kinematics运动学逆解

% % Inverse kinematics is the problem of finding the robot joint coordinates, % given a homogeneous transform representing the last link of the manipulator.% It is very useful when the path is planned in Cartesian space, for instance % a straight line path as shown in the trajectory demonstration.% % First generate the transform corresponding to a particular joint coordinate,q = [0-pi/4-pi/4 0 pi/8 0] q =

0

-0.7854

-0.7854

0

0.3927

0

T = fkine(p560, q);% % Now the inverse kinematic procedure for any specific robot can be derived

% symbolically and in general an efficient closed-form solution can be

% obtained.However we are given only a generalized description of the

% manipulator in terms of kinematic parameters so an iterative solution will

% be used.The procedure is slow, and the choice of starting value affects

% search time and the solution found, since in general a manipulator may

% have several poses which result in the same transform for the last % link.The starting point for the first point may be specified, or else it % defaults to zero(which is not a particularly good choice in this case)

qi = ikine(p560, T);

qi' ans =

-0.0000

-0.7854

-0.7854

-0.0000

0.3927

0.0000 % % Compared with the original value

q q =

0

-0.7854

-0.7854

0

0.3927

0 % % A solution is not always possible, for instance if the specified transform

% describes a point out of reach of the manipulator.As mentioned above

% the solutions are not necessarily unique, and there are singularities

% at which the manipulator loses degrees of freedom and joint coordinates

% become linearly dependent.pause % any key to continue % % To examine the effect at a singularity lets repeat the last example but for a % different pose.At the `ready' position two of the Puma's wrist axes are

% aligned resulting in the loss of one degree of freedom.T = fkine(p560, qr);

qi = ikine(p560, T);

qi' ans =

-0.0000

1.5238

-1.4768

-0.0000

-0.0470

0.0000 % % which is not the same as the original joint angle

qr qr =

0

1.5708

-1.5708

0

0

0

pause % any key to continue % % However both result in the same end-effector position

fkine(p560, qi)-fkine(p560, qr)ans =

1.0e-015 *

0

-0.0000

-0.0902

-0.0694

0.0000

0

-0.0000

0

0.0902

0.0000

0

0.1110

0

0

0

0

pause % any key to continue

% Inverse kinematics may also be computed for a trajectory.% If we take a Cartesian straight line path

t = [0:.056:2];

% create a time vector

T1 = transl(0.6,-0.5, 0.0)% define the start point T1 =

1.0000

0

0

0.6000

0

1.0000

0

-0.5000

0

0

1.0000

0

0

0

0

1.0000

T2 = transl(0.4, 0.5, 0.2)% and destination T2 =

1.0000

0

0

0.4000

0

1.0000

0

0.5000

0

0

1.0000

0.2000

0

0

0

1.0000

T = ctraj(T1, T2, length(t));% compute a Cartesian path % % now solve the inverse kinematics.When solving for a trajectory, the

% starting joint coordinates for each point is taken as the result of the

% previous inverse solution.%

tic

q = ikine(p560, T);

toc Elapsed time is 0.315656 seconds.% % Clearly this approach is slow, and not suitable for a real robot controller

% where an inverse kinematic solution would be required in a few milliseconds.% % Let's examine the joint space trajectory that results in straightline % Cartesian motion

subplot(3,1,1)

plot(t,q(:,1))

xlabel('Time(s)');

ylabel('Joint 1(rad)')

subplot(3,1,2)

plot(t,q(:,2))

xlabel('Time(s)');

ylabel('Joint 2(rad)')

subplot(3,1,3)

plot(t,q(:,3))

xlabel('Time(s)');

ylabel('Joint 3(rad)')

pause % hit any key to continue

% This joint space trajectory can now be animated

plot(p560, q)pause % any key to continue

echo off %

六、Jacobians雅可比---矩阵与速度

% Jacobian and differential motion demonstration % % A differential motion can be represented by a 6-element vector with elements % [dx dy dz drx dry drz] % % where the first 3 elements are a differential translation, and the last 3 % are a differential rotation.When dealing with infinitisimal rotations,% the order becomes unimportant.The differential motion could be written

% in terms of compounded transforms % % transl(dx,dy,dz)* rotx(drx)* roty(dry)* rotz(drz)% % but a more direct approach is to use the function diff2tr()%

D = [.1.2 0-.2.1.1]';

diff2tr(D)ans =

0

-0.1000

0.1000

0.1000

0.1000

0

0.2000

0.2000

-0.1000

-0.2000

0

0

0

0

0

0

pause % any key to continue % % More commonly it is useful to know how a differential motion in one

% coordinate frame appears in another frame.If the second frame is

% represented by the transform

T = transl(100, 200, 300)* roty(pi/8)* rotz(-pi/4);% % then the differential motion in the second frame would be given by

DT = tr2jac(T)* D;

DT' ans =

-29.5109

69.7669-42.3289

-0.2284

-0.0870

0.0159 % % tr2jac()has computed a 6x6 Jacobian matrix which transforms the differential

% changes from the first frame to the next.% pause % any key to continue

% The manipulator's Jacobian matrix relates differential joint coordinate

% motion to differential Cartesian motion;% % dX = J(q)dQ % % For an n-joint manipulator the manipulator Jacobian is a 6 x n matrix and % is used is many manipulator control schemes.For a 6-axis manipulator like % the Puma 560 the Jacobian is square % % Two Jacobians are frequently used, which express the Cartesian velocity in % the world coordinate frame,q = [0.1 0.75-2.25 0.75 0] q =

0.1000

0.7500

-2.2500

0

0.7500

0

J = jacob0(p560, q)J =

0.0746

-0.3031

-0.0102 0

0.7593

-0.0304

-0.0010 0

0

0.7481

0.4322 0

0.0000

0.0998

0.0998 0.6782

0

-0.9950

-0.9950 0.0681

1.0000

0.0000

0.0000 0.7317 % % or the T6 coordinate frame

J = jacobn(p560, q)

0

0

0 0.9925 0.0996 0.0707

0

0

0 0.0998-0.9950 0.0000

J =

0.1098

-0.7328

-0.3021

0

0

0

0.7481

0.0000

0.0000

0

0

0

0.1023

0.3397

0.3092

0

0

0

-0.6816

0

0

0.6816

0

0

-0.0000

-1.0000

-1.0000

-0.0000

-1.0000

0

0.7317

0.0000

0.0000

0.7317

0.0000

1.0000 % % Note the top right 3x3 block is all zero.This indicates, correctly, that % motion of joints 4-6 does not cause any translational motion of the robot's % end-effector.pause % any key to continue % % Many control schemes require the inverse of the Jacobian.The Jacobian % in this example is not singular

det(J)ans =

-0.0632 % % and may be inverted

Ji = inv(J)Ji =

0.0000

1.3367

-0.0000 0

-2.4946

0.6993

-2.4374 0

0.0000-0.0000 0.0000-0.0000

2.7410

-1.2106

5.9125

0.0000

0.0000

0

0.0000

1.3367

-0.0000

1.4671

-0.0000

0

-0.2464

0.5113

-3.4751

-0.0000

-1.0000

0

-0.0000

-1.9561

0.0000

-1.0734

0.0000

1.0000

pause % any key to continue % % A classic control technique is Whitney's resolved rate motion control % % dQ/dt = J(q)^-1 dX/dt % % where dX/dt is the desired Cartesian velocity, and dQ/dt is the required % joint velocity to achieve this.vel = [1 0 0 0 0 0]';% translational motion in the X direction

qvel = Ji * vel;

qvel' ans =

0.0000

-2.4946

2.7410

0.0000

-0.2464

-0.0000 % % This is an alternative strategy to computing a Cartesian trajectory

% and solving the inverse kinematics.However like that other scheme, this % strategy also runs into difficulty at a manipulator singularity where % the Jacobian is singular.pause % any key to continue % % As already stated this Jacobian relates joint velocity to end-effector

% velocity expressed in the end-effector reference frame.We may wish

% instead to specify the velocity in base or world coordinates.% % We have already seen how differential motions in one frame can be translated

% to another.Consider the velocity as a differential in the world frame, that % is, d0X.We can write % d6X = Jac(T6)d0X %

T6 = fkine(p560, q);% compute the end-effector transform

d6X = tr2jac(T6)* vel;% translate world frame velocity to T6 frame

qvel = Ji * d6X;% compute required joint velocity as before

qvel' ans =

-0.1334

-3.5391

6.1265

-0.1334

-2.5874

0.1953 % % Note that this value of joint velocity is quite different to that calculated % above, which was for motion in the T6 X-axis direction.pause % any key to continue % % At a manipulator singularity or degeneracy the Jacobian becomes singular.% At the Puma's `ready' position for instance, two of the wrist joints are % aligned resulting in the loss of one degree of freedom.This is revealed by % the rank of the Jacobian

rank(jacobn(p560, qr))ans = % % and the singular values are

svd(jacobn(p560, qr))ans =

1.9066

1.7321

0.5660

0.0166

0.0081

0.0000

pause % any key to continue % % When not actually at a singularity the Jacobian can provide information

% about how `well-conditioned' the manipulator is for making certain motions, % and is referred to as `manipulability'.% % A number of scalar manipulability measures have been proposed.One by % Yoshikawa

maniplty(p560, q, 'yoshikawa')ans =

[] % % is based purely on kinematic parameters of the manipulator.% % Another by Asada takes into account the inertia of the manipulator which

% affects the acceleration achievable in different directions.This measure

% varies from 0 to 1, where 1 indicates uniformity of acceleration in all % directions

maniplty(p560, q, 'asada')ans =

[] % % Both of these measures would indicate that this particular pose is not well % conditioned.pause % any key to continue

% An interesting class of manipulators are those that are redundant, that is, % they have more than 6 degrees of freedom.Computing the joint motion for % such a manipulator is not straightforward.Approaches have been suggested % based on the pseudo-inverse of the Jacobian(which will not be square)or % singular value decomposition of the Jacobian.% echo off

七、Inverse Dynamics逆向动力学

% % Inverse dynamics computes the joint torques required to achieve the specified % state of joint position, velocity and acceleration.% The recursive Newton-Euler formulation is an efficient matrix oriented % algorithm for computing the inverse dynamics, and is implemented in the % function rne().% % Inverse dynamics requires inertial and mass parameters of each link, as well % as the kinematic parameters.This is achieved by augmenting the kinematic

% description matrix with additional columns for the inertial and mass

% parameters for each link.% % For example, for a Puma 560 in the zero angle pose, with all joint velocities % of 5rad/s and accelerations of 1rad/s/s, the joint torques required are %

tau = rne(p560, qz, 5*ones(1,6), ones(1,6))tau =

-79.4048

37.1694

13.5455

1.0728

0.9399

0.5119

pause % any key to continue

% As with other functions the inverse dynamics can be computed for each point

% on a trajectory.Create a joint coordinate trajectory and compute velocity % and acceleration as well

t = [0:.056:2];

% create time vector

[q,qd,qdd] = jtraj(qz, qr, t);% compute joint coordinate trajectory

tau = rne(p560, q, qd, qdd);% compute inverse dynamics % % Now the joint torques can be plotted as a function of time

plot(t, tau(:,1:3))

xlabel('Time(s)');

ylabel('Joint torque(Nm)')pause % any key to continue

% % Much of the torque on joints 2 and 3 of a Puma 560(mounted conventionally)is % due to gravity.That component can be computed using gravload()

taug = gravload(p560, q);

plot(t, taug(:,1:3))

xlabel('Time(s)');

ylabel('Gravity torque(Nm)')pause % any key to continue

% Now lets plot that as a fraction of the total torque required over the % trajectory

subplot(2,1,1)

plot(t,[tau(:,2)taug(:,2)])

xlabel('Time(s)');

ylabel('Torque on joint 2(Nm)')

subplot(2,1,2)

plot(t,[tau(:,3)taug(:,3)])

xlabel('Time(s)');

ylabel('Torque on joint 3(Nm)')pause % any key to continue

% % The inertia seen by the waist(joint 1)motor changes markedly with robot

% configuration.The function inertia()computes the manipulator inertia matrix % for any given configuration.% % Let's compute the variation in joint 1 inertia, that is M(1,1), as the

% manipulator moves along the trajectory(this may take a few minutes)

M = inertia(p560, q);

M11 = squeeze(M(1,1,:));

plot(t, M11);

xlabel('Time(s)');

第二篇:matlab的nntool工具箱小结

拟合以及插值还有逼近是数值分析的三大基础工具,通俗意义上它们的区别在于:拟合是已知点列,从整体上靠近它们;插值是已知点列并且完全经过点列;逼近是已知曲线,或者点列,通过逼近使得构造的函数无限靠近它们。

新建训练使用输入数据X和目标数据Y,如下所示,X是3个输入变量,20个样本,Y是1个输出变量,20个样本(注意,输入和输出的样本数一定要相同,matlab 神经网络工具箱中默认一行是一个变量,列代表样本)

matlab命令窗口输入,nnstart,启动神经网络工具箱。

点击Fitting app,得到如下

点击Next,得到如下,并选择Inputs和Targets数据:

在下图设置完validation和testing之后,点击Next

注意,这里的Training、Validation和Testing的意义如下所示: training是训练数据,拿来拟合模型,就是用这部分数据来建立模型,这个相信大家都明白。

validation是验证数据,刚才说training建了一个模型,但是模型的效果仅体现了训练数据,但不一定适合同类的其他数据,所以我们会在建模前会将数据分成两部分,一部分为训练数据,一部分为验证数据(两部分数据的比例大致为7:3,这取决于你验证的方法,详细说明我从网上摘了下放在本次说明的最下边,但愿你能看懂);另外,你也可能训练多个模型,但不知哪个模型性能更佳,这时可以将验证数据输入不同模型进行比较。

testing是测试数据,它跟前两者的最大区别在于:training和validation数据均是同一时期的数据,如都是5-7月数据,但既然是测试,我们就需要用跨期的数据来验证模型的稳定性,此时,可采用8月单月数据或9月单月数据对建好的模型进行测试,看性能有没有下降或偏移。

设置Number of Hidden Neurons之后,点击Next

设置完training algorithm之后,点击Training

多次点击Retrain,直到下图红圈中的三个MSE值达到尽可能小的值为止。点击Next。

上图红框中Training后面的MSE数据代表用来参与神经网络训练training的那部分数据,把输入数据带入神经网络模型后,输出数据与目标数据偏差平方和的均值,validation后面的MSE数据表示,用来进行validation数据,把输入数据带入之后,输出数据与目标数据之间的偏差平方的平均值。testing后面的数据表示用来进行testing的MSE数据,把输入数据带入之后,输出数据与目标数据之间的偏差平方的平均值。

下图点击“Next”

点击Matlab Function,把训练形成的神经网络函数保存下来

出现下图之后,保存

然后用这个函数,就可以对新的输入进行预测了。比如新建了一个输入如下所示:

使用函数myNeuralNetworkFunction(X1)得到如下预测结果:

注意,有的时候,X1设置为X的第一列,myNeuralNetworkFunction(X1)的到的值与myNeuralNetworkFunction(X)第一个值不同,理论上应该相同,想不明白,后来发现,重启matlab,重新做一遍就好了,可能是哪个地方我操作不当导致程序错乱了。

第三篇:matlab总结

附录1.1 管理用命令

函数名 功能描述 增加一条搜索路径 addpath doc help 装入超文本文档 启动联机帮助

函数名 rmpath version what which

功能描述

删除一条搜索路径 列出.M文件

显示Matlab的版本号 列出当前目录下的有关文件 造出函数与文件所在的目录 demo 运行Matlab演示程序 type lasterr 显示最后一条信息 lookfor 搜索关键词的帮助 path

显示Matlab的新特性 whatsnew 设置或查询Matlab路径

附录1.2管理变量与工作空间用命令

函数名 功能描述 disp 显示矩阵与文本 查询向量的维数 length load 从文件中装入数据

函数名 save size

功能描述

整理工作空间内存 将工作空间中的变量存盘 查询矩阵的维数 clear 删除内存中的变量与函数 pack

列出工作空间中的变量名 who,whos

附录1.3文件与操作系统处理命令

函数名 功能描述 cd 改变当前工作目录

删除文件 delete dir!列出当前目录的内容 执行操作系统命令

函数名 edit

功能描述 编辑.M文件 获得系统的缓存目录

获得Matlab的安装根目录 matlabroot

获得一个缓存(temp)文件 tempname diary 将Matlab运行命令存盘 tempdir

附录1.4窗口控制命令

函数名 功能描述 设置输出格式 format

函数名 功能描述

echo 显示文件中的Matlab中的命令 more 控制命令窗口的输出页面

附录1.5启动与退出命令

函数名

功能描述

函数名 功能描述 quit 退出Matlab环境

启动主程序 matlabrc startup Matlab自启动程序

附录2 运算符号与特殊字符附录 2.1运算符号与特殊字符

函数名 功能描述 +-* 加 减 矩阵乘

函数名 功能描述...,;

续行标志

分行符(该行结果不显示)分行符(该行结果显示).* ^.^ /../ :()[] {}..xor 向量乘 矩阵乘方 向量乘方 矩阵左除 矩阵右除 向量左除 向量右除

向量生成或子阵提取 下标运算或参数定义 矩阵生成

结构字段获取符 逻辑运算之异成

%!.= == ~= < <= > >= & |

注释标志

操作系统命令提示符 矩阵转置 向量转置 赋值运算 关系运算之相等 关系运算之不等 关系运算之小于 关系运算之小于等于 关系运算之大于 关系运算之大于等于 逻辑运算之与 逻辑运算之或 逻辑运算之非 kron 矩阵kron积

点乘运算,常与其他运算符联合使用(如.)~

附录2.2逻辑函数

函数名 功能描述 all any 测试向量中是否有真元素 exist 检验变量或文件是否定义 find 查找非零元素的下标

函数名 *isa logical

功能描述

检测对象是否为某一个类的对象 将数字量转化为逻辑量 测试向量中所用元素是否为真 is*(一类函数)检测向量状态.其中*表示一个确定的函数(isinf)

附录3 语言结构与调试 附录3.1编程语言

函数名 功能描述

builtin 执行Matlab内建的函数 eval feval 执行字符串指定的文件

函数名 功能描述 global 定义全局变量

script Matlab语句及文件信息

执行Matlab语句构成的字符串 函数输入输出参数个数检验 nargchk Matlab函数定义关键词 function

附录3.2控制流程

函数名 功能描述

break 中断循环执行的语句 else 与if一起使用的转移语句 elseif 与if一起使用的转移语句 end 结束控制语句块 error 显示错误信息 for 循环语句

函数名 if return switch while

功能描述 条件转移语句 返回调用函数

与case结合实现多路转移 循环语句

多路转移中的缺省执行部分 case 与switch结合实现多路转移 otherwise

warning 显示警告信息

附录3.3交互输入

函数名 input

功能描述 请求输入

函数名 功能描述 menu 菜单生成

启动键盘管理 暂停执行 keyboard pause

附录3.4面向对象编程

函数名 class

功能描述 生成对象

函数名 isa

功能描述

判断对象是否属于某一类 转换成8字节的无符号整数

建立类的层次关系 double 转换成双精度型 superiorto 建立类的层次关系 inferiorto unit8 inline

建立一个内嵌对象

附录3.5调试

函数名 功能描述 dbclear 清除调试断点 dbcont 调试继续执行

函数名 功能描述

列出所有断点情况 dbstatus dbstep 单步执行

改变局部工作空间内存 dbstop 设置调试断点 dbdown dbmex 启动对Mex文件的调试 sbtype 列出带命令行标号的.M文件 dbquit 退出调试模式 列出函数调用关系 dbstack

dbup

改变局部工作空间内容

附录4 基本矩阵与矩阵处理 附录4.1基本矩阵

函数名 eye

功能描述 产生单位阵

函数名 功能描述 rand 产生随机分布矩阵 产生正态分布矩阵 randn

产生向量 linspace 构造线性分布的向量 ones

构造等对数分布的向量 zeros 产生零矩阵 logspace

产生元素全部为1的矩阵 :

附录4.2特殊向量与常量

函数名 ans eps flops i inf j 功能描述

缺省的计算结果变量

函数名 non

功能描述

非数值常量常由0/0或Inf/Inf获得 函数中参数输入个数 圆周率 computer 运行Matlab的机器类型 nargin 浮点运算计数 复数单元 无穷大 复数单元

pi 精度容许误差(无穷小)nargout 函数中输出变量个数

realmax 最大浮点数值 realmin 最小浮点数值

varargin 函数中输入的可选参数 函数中输出的可选参数 varargout 输入参数名 inputname

附录4.3时间与日期

函数名

功能描述

函数名

功能描述 calender 日历 clock date

时钟 日期 cputime 所用的CPU时间 日期(数字串格式)datenum datestr 日期(字符串格式)

eomday 计算月末 etime now tic toc

所用时间函数 当前日期与时间 启动秒表计时器 读取秒表计时器

星期函数 weekday datevoc 日期(年月日分立格式)

附录4.4矩阵处理

函数名 功能描述 cat diag fliplr 向量连接

按左右方向翻转矩阵元素

函数名 功能描述 改变矩阵行列个数 reshape tril triu

取矩阵的下三角部分 取矩阵的上三角部分 建立对角矩阵或获取对角向量 rot90 将矩阵旋转90度

flipud 按上下方向翻转矩阵元素 复制并排列矩阵函数 repmat

附录5 特殊矩阵

函数名 gallery hankel hilb 功能描述

函数名

功能描述 生成magic矩阵 生成pascal矩阵 compan 生成伴随矩阵

invhilb 生成逆hilbert矩阵

生成一些小的测试矩阵 magic 生成hankel矩阵 生成hilbert矩阵 生成hadamard矩阵 pascal hadamard

toeplitz 生成toeplitz矩阵

生成wilkinson特征值测试矩阵 wilkinson

附录6 数学函数 附录6.1三角函数

函数名 sin/asin 功能描述 正弦/反正弦函数

函数名

功能描述

sec/asec 正割/反正割函数 csc/acsc cot/acot

余割/反余割函数 余切/反余切函数

双曲正割/反双曲正割函数 sinh/asinh 双曲正弦/反双曲正弦函数 sech/asech cos/acos 余弦/反余弦函数 tan/atan 正切/反正切函数 atan2 四个象限内反正切函数 双曲余弦/反双曲余弦函数 双曲余割/反双曲余割函数 cosh/acosh csch/acsch 双曲正切/反双曲正切函数 tanh/atanh coth/acoth 双曲余切/反双曲余切函数

附录6.2指数函数

函数名 功能描述 exp 指数函数 log

函数名 功能描述 log10 常用对数函数

自然对数函数 sqrt平方根函数

附录6.3复数函数

函数名 功能描述 函数名 功能描述

abs 绝对值函数 imag 求虚部函数 angle 角相位函数 real 求实部函数 conj 共轭复数函数

附录6.4数值处理

函数名 功能描述 fix

函数名 功能描述

沿零方向取整 round 舍入取整

floor 沿-∞方向取整 rem 求除法的余数 ceil 沿+∞方向取整 sign 符号函数

附录6.5其他特殊数学函数

函数名 功能描述 airy airy函数

函数名 erfcx

功能描述 比例互补误差函数 逆误差函数 指数积分函数 gamma函数 bessel函数(hankel函数)besselh erfinv bessili 改进的第一类bessel函数 expint 改进的第二类bessel函数 gamma besselk besselj 第一类bessel函数 第二类bessel函数 bessely beta beta函数

非完全的beta函数 betainc betaln beta对数函数 elipj erf erfc Jacobi椭圆函数 误差函数 互补误差函数 ellipke 完全椭圆积分

非完全gamma函数 gammainc

gammaln gamma对数函数 gcd lcm log2 pow2 rat rats

最大公约数 最小公倍数 分割浮点数 基2标量浮点数 有理逼近有理输出

legendre legendre伴随函数

附录7 坐标转换

函数名 功能描述

函数名

功能描述

cart2pol 笛卡儿坐标到极坐标转换 pol2cart 极坐标到笛卡儿坐标转换 笛卡儿坐标到球面坐标转换 球面坐标到笛卡儿坐标转换 cart2sph sph2cart

附录8 矩阵函数 附录8.1矩阵分析

函数名 功能描述 det

函数名

功能描述

LINPACK倒数条件估计 矩阵的行阶梯型实现 cond 求矩阵的条件数 rcond

求矩阵的行列式 rref

消元法解方程演示 norm 求矩阵的范数 rrefmovie null 右零空间 orth 正交空间 rank 求矩阵的秩

subspace 子空间 trace

矩阵的迹

附录8.2线性方程

函数名 功能描述 /, inv lu

线性方程求解 矩阵求逆 chol Cholesky分解 lscov 最小二乘方差

函数名 功能描述 nnls pinv qr

非零最小二乘 求伪逆矩阵 矩阵的QR分解

QR分解中删除一行 qrdelete

矩阵的LU三角分解 qrinsert QR分解中插入一行

附录8.3特征值与奇异值

函数名 功能描述

函数名 功能描述

QZ算法求矩阵特征值 改进特征值精度的均衡变换 qz banlance eig hess poly

实块对角阵到复块对角阵转换 cdf2rdf 复块对角阵到实块对角阵转换 rdf2cdf 求矩阵的特征值和特征向量 schur Schur分解 求Hessenberg矩阵 求矩阵的特征多项式

svd

奇异值分解

附录8.4矩阵函数

函数名 功能描述

函数名 功能描述

expm 矩阵指数函数 logm 矩阵对数函数 矩阵平方根 funm 矩阵任意函数 sqrtm

附录9 数据分析与Fourier变换函数 附录9.1基本运算

函数名

功能描述

函数名 功能描述 prod sort

对向量中各元素求积 对向量中各元素排序 求向量中各元素标准差 对向量中各元素求和 梯形法求数值积分

向量累积 cumprod cumsum 向量累加 max min mean

求向量中最大元素 sortrows 对矩阵中各行排序 求向量中最小元素 std 求向量中各元素均值 sum median 求向量中中间元素 trapz

附录9.2微分计算

函数名功 能描述 函数名 功能描述

梯度计算 del2 离散Laplace变换 gradient diff 差分于近视微分

附录9.3滤波与卷积

函数名 功能描述

函数名 功能描述 Conv 卷给与多项式乘法 filter 一维数字滤波 conv2 二维卷积 filter2 二维数字滤波

因式分解与多项式乘法

Deconv

附录9.4方差处理

函数名 功能描述 函数名功 能描述

相关系数计算c ov 协方差计算 corrcoef

附录9.5Fourier变换

函数名 功能描述 函数名 功能描述

绝对值函数 abs fftshift fft与fft2输出重排

离散Fourier逆变换 angle 相角函数 ifft 依共轭复数对重新排序i fft2 二维离散Fourier逆变换 cplxpair 离散Fourier变换 相角矫正 fft unwrap 二维离散Fourier变换 fft2

附录10 多项式处理函数 附录10.1多项式处理

函数名 功能描述 函数名 功能描述 conv 卷机与多项式乘法 polyfit 数据的多项式拟合

因式分解与多项式乘法p olyval 多项式求值 deconv

多项式矩阵求值 poly 求矩阵的特征多项式 polyvalm 多项式求导 polyder residue 部分分式展开

polyeig 多项式特征值 roots 求多项式的根

附录10.2数据插值

第四篇:MATLAB

《MATLAB及其应用》上机实验报告

____《第一章 MATLAB7.3环境》报告

第一章:第8、9、10题。目的:熟悉MATLAB7.3的环境,熟练掌握MATLAB通过命令管理变量和文件管理命令的功能。P306 第8题:

1234输入变量a=5.3,b=“A:exe0101.mat”文件。

在工作空间中使用who,whos,exist,clear命令将变量存入程序文档、运行过程和结果: >> a=5.3;b=[1 2;3 4] b =

4>> who Your variables are: a b

>> whos

Name

Size

Bytes Class

Attributes

a

1x1 double

b

2x2

double

>> exist('a')ans =

>> clear >> exist a ans =

0 >> exist b ans =

0 >> save C:/exe0101.mat >>心得体会:通过这题,我们可以用who,whos来查询数据种类情况,可以用exist来查询数据的数目,知道clear来清除数据的数目,clc是用来清除command window的显示,使它不会显得太杂乱,save是一个很方便的保存方法。

第9题:

使用文件管理命令dir、matlabroot、what、type、which查看“··MATLAB”目录下的文件信息。>> dir C:matlab

..exe0101.mat exe0102.mat

>> matlabroot ans = C:matlab >> what D: MAT-files in directory D:

exe0101

>> type exe0101.mat MATLAB 5.0 MAT-file, Platform: PCWIN, Created on: Mon Nov 07 20:12:08 2011

>> which exe0101.mat C:matlabexe0101.mat 心得体会:dir、matlabroot、what、type、which等查看方式,可以对“...matlab”下的文件进行方便的查询了解。第10题:

学习设置MATLAB搜索路径的方法,将“A: exe”目录添加到搜索路径中,并移去搜索路径。在MATLAB界面选择菜单“File”→ “Set Path”的命令。选择A:exe,单击save。这时A:exe便添加到搜索路径。若点A:exe,再点击Remove,将已有的目录移除。心得体会:练习了搜索路径的方式,以后对文件的搜索及文件搜索有了更纯熟的应用。疑问:并没有A:exe目录存在,是否是题目问题。

第五篇:matlab指令总结

MATLAB命令大全

管理命令和函数? help 在线帮助文件? doc 装入超文本说明? what M、MAT、MEX文件的目录列表? type 列出M文件? lookfor 通过help条目搜索关键字? which 定位函数和文件? Demo 运行演示程序? Path 控制MATLAB的搜索路径 ? 管理变量和工作空间? Who 列出当前变量? Whos 列出当前变量(长表)Load 从磁盘文件中恢复变量? Save 保存工作空间变量? Clear 从内存中清除变量和函数? Pack 整理工作空间内存? Size 矩阵的尺寸? Length 向量的长度? disp 显示矩阵或? 与文件和操作系统有关的命令?? cd 改变当前工作目录? Dir 目录列表? Delete 删除文件? Getenv 获取环境变量值?!执行DOS操作系统命令? Unix 执行UNIX操作系统命令并返回结果? Diary 保存MATLAB任务?? 控制命令窗口? Cedit 设置命令行编辑? Clc 清命令窗口? Home 光标置左上角? Format 设置输出格式? Echo 底稿文件内使用的回显命令? more 在命令窗口中控制分页输出?? 启动和退出MATLAB?? Quit 退出MATLAB? Startup 引用MATLAB时所执行的M文件? Matlabrc 主启动M文件? 一般信息? Info MATLAB系统信息及Mathworks公司信息? Subscribe 成为MATLAB的订购用户?

hostid MATLAB主服务程序的识别代号? Whatsnew 在说明书中未包含的新信息? Ver 版本信息? 操作符和特殊字符 * 矩阵乘法?.* 数组乘法? ^ 矩阵幂?.^ 数组幂? 左除或反斜杠 / 右除或斜杠?./ 数组除?

Kron Kronecker张量积?..父目录? „ 继续? % 注释??

' 转置或引用? = 赋值? = = 相等?

< > 关系操作符? & 逻辑与? | 逻辑或? ~ 逻辑非? xor 逻辑异或? 逻辑函数?

Exist 检查变量或函数是否存在? Any 向量的任一元为真,则其值为真? All 向量的所有元为真,则其值为真? Find 找出非零元素的索引号? 三角函数? Sin 正弦?

Sinh 双曲正弦? Asin 反正弦?

Asinh 反双曲正弦? Cos 余弦?

Cosh 双曲余弦? Acos 反余弦?

Acosh 反双曲余弦? Tan 正切?

Tanh 双曲正切? Atan 反正切?

Atan2 四象限反正切? Atanh 反双曲正切? Sec 正割?

Sech 双曲正割? Asech? 反双曲正割? Csc 余割? Csch 双曲余割? Acsc 反余割? Acsch 反双曲余割? Cot 余切? Coth 双曲余切? Acot 反余切? Acoth 反双曲余切? 指数函数? Exp 指数? Log 自然对数? Log10 常用对数? Sqrt平方根? 复数函数? Abs 绝对值? Argle 相角? Conj 复共轭? Image 复数虚部? Real 复数实部? 数值函数? Fix 朝零方向取整? Floor 朝负无穷大方向取整? Ceil 朝正无穷大方向取整? Round 朝最近的整数取整? Rem 除后取余? Sign 符号函数? 基本矩阵? Zeros 零矩阵? Ones 全“1”矩阵? Eye 单位矩阵? Rand 均匀分布的随机数矩阵? Randn 正态分布的随机数矩阵? Logspace 对数间隔的向量? Meshgrid 三维图形的X和Y数组? : 规则间隔的向量? 特殊变量和常数? Ans 当前的答案 Eps 相对浮点精度? Realmax 最大浮点数? Realmin 最小浮点数? Pi 圆周率? I,j 虚数单位? Inf 无穷大? Nan 非数值?

Flops 浮点运算次数? Nargin 函数输入变量数? Nargout 函数输出变量数? Computer 计算机类型?

Isieee 当计算机采用IEEE算术标准时,其值为真?

Why 简明的答案?

Version MATLAB版本号? 时间和日期 Clock 挂钟? Date 日历?

Etime 计时函数? Tic 秒表开始计时? Toc 计时函数?

Cputime CPU时间(以秒为单位)? 矩阵操作?

Diag 建立和提取对角阵? Fliplr 矩阵作左右翻转? Flipud 矩阵作上下翻转? Reshape 改变矩阵大小? Rot90 矩阵旋转90度?

Tril 提取矩阵的下三角部分? Triu 提取矩阵的上三角部分? : 矩阵的索引号,重新排列矩阵? Compan 友矩阵?

Hadamard Hadamard矩阵? Hankel Hankel矩阵? Hilb Hilbert矩阵?

Invhilb 逆Hilbert矩阵? Kron Kronecker张量积? Magic 魔方矩阵?

Toeplitz Toeplitz矩阵? Vander Vandermonde矩阵? 矩阵分析??

Cond 计算矩阵条件数? Norm 计算矩阵或向量范数? Rcond Linpack 逆条件值估计? Rank 计算矩阵秩?

Det 计算矩阵行列式值? Trace 计算矩阵的迹? Null 零矩阵? Orth 正交化? 线性方程? 和/ 线性方程求解 Chol Cholesky分解? Lu 高斯消元法求系数阵? Inv 矩阵求逆? Qr 正交三角矩阵分解(QR分解)? Pinv 矩阵伪逆? 特征值和奇异值? Eig 求特征值和特征向量? Poly 求特征多项式? Hess Hessberg形式? Qz 广义特征值? Cdf2rdf 变复对角矩阵为实分块对角形式? Schur Schur分解? Balance 矩阵均衡处理以提高特征值精度? Svde 奇异值分解? 矩阵函数? Expm 矩阵指数? Expm1 实现expm的M文件? Expm2 通过泰勒级数求矩阵指数? Expm3 通过特征值和特征向量求矩阵指数? Logm 矩阵对数? Sqrtm 矩阵开平方根? Funm 一般矩阵的计算? 泛函——非线性数值方法? Ode23 低阶法求解常微分方程? Ode23p 低阶法求解常微分方程并绘出结果图形? Ode45 高阶法求解常微分方程? Quad 低阶法计算数值积分? Quad8 高阶法计算数值积分? Fmin 单变量函数的极小变化? Fmins 多变量函数的极小化? Fzero 找出单变量函数的零点? Fplot 函数绘图? 多项式函数? Roots 求多项式根? Poly 构造具有指定根的多项式? Polyvalm 带矩阵变量的多项式计算? Residue 部分分式展开(留数计算)? Polyfit 数据的多项式拟合? Polyder 微分多项式? Conv 多项式乘法? Deconv 多项式除法? 建立和控制图形窗口? Figure 建立图形?

Gcf 获取当前图形的句柄? Clf 清除当前图形? Close 关闭图形? 建立和控制坐标系

Subplot 在标定位置上建立坐标系? Axes 在任意位置上建立坐标系? Gca 获取当前坐标系的句柄? Cla 清除当前坐标系?

Axis 控制坐标系的刻度和形式? Caxis 控制伪彩色坐标刻度? Hold 保持当前图形? 句柄图形对象?

Figure 建立图形窗口? Axes 建立坐标系? Line 建立曲线? Text 建立文本串?

Patch 建立图形填充块? Surface 建立曲面? Image 建立图像?

Uicontrol 建立用户界面控制 Uimen 建立用户界面菜单? 句柄图形操作? Set 设置对象? Get 获取对象特征? Reset 重置对象特征? Delete 删除对象?

Newplot 预测nextplot性质的M文件? Gco 获取当前对象的句柄? Drawnow 填充未完成绘图事件? Findobj 寻找指定特征值的对象? 打印和存储?

Print 打印图形或保存图形?

Printopt 配置本地打印机缺省值? Orient 设置纸张取向?

Capture 屏幕抓取当前图形? 基本X—Y图形? Plot 线性图形?

Loglog 对数坐标图形?

Semilogx 半对数坐标图形(X轴为对数坐标)?

Semilogy 半对数坐标图形(Y轴为对数坐标)?

Fill 绘制二维多边形填充图? 特殊X—Y图形? Polar 极坐标图? Bar 条形图? Stem 离散序列图或杆图? Stairs 阶梯图? Errorbar 误差条图? Hist 直方图? Rose 角度直方图? Compass 区域图? Feather 箭头图? Fplot 绘图函数? Comet 星点图? 图形注释

Title 图形标题? Xlabel X轴标记? Ylabel Y轴标记? Text 文本注释? Gtext 用鼠标放置文本? Grid 网格线? MATLAB编程语言

Function 增加新的函数? Eval 执行由MATLAB表达式构成的字串? Feval 执行由字串指定的函数? Global 定义全局变量? 程序控制流? If 条件执行语句? Else 与if命令配合使用? Elseif 与if命令配合使用? End For,while和if语句的结束? For 重复执行指定次数(循环)? While?重复执行不定次数(循环)? Break 终止循环的执行? Return 返回引用的函数? Error 显示信息并终止函数的执行? 交互输入? Input 提示用户输入? Keyboard 像底稿文件一样使用键盘输入? Menu 产生由用户输入选择的菜单? Pause 等待用户响应

Uimenu 建立用户界面菜单? Uicontrol 建立用户界面控制? 一般字符串函数? Strings MATLAB中有关字符串函数的说明? Abs 变字符串为数值? Setstr 变数值为字符串?

Isstr 当变量为字符串时其值为真? Blanks 空串?

Deblank 删除尾部的空串?

Str2mat 从各个字符串中形成文本矩阵? Eval 执行由MATLAB表达式组成的串? 字符串比较

Strcmp 比较字符串?

Findstr 在一字符串中查找另一个子串? Upper 变字符串为大写? Lower 变字符串为小写?

Isletter 当变量为字母时,其值为真? Isspace 当变量为空白字符时,其值为真? 字符串与数值之间变换? Num2str 变数值为字符串? Int2str 变整数为字符串? Str2num 变字符串为数值?

Sprintf 变数值为格式控制下的字符串? Sscanf 变字符串为格式控制下的数值? 十进制与十六进制数之间变换?

Hex2num 变十六进制为IEEE标准下的浮点数?

Hex2dec 变十六制数为十进制数? Dec2hex 变十进制数为十六进制数? 建模?

Append 追加系统动态特性? Augstate 变量状态作为输出?

Blkbuild 从方框图中构造状态空间系统? Cloop 系统的闭环? Connect 方框图建模? Conv 两个多项式的卷积?

Destim 从增益矩阵中形成离散状态估计器?

Dreg 从增益矩阵中形成离散控制器和估计器?

Drmodel 产生随机离散模型?

Estim 从增益矩阵中形成连续状态估计器? Feedback 反馈系统连接?

Ord2 产生二阶系统的A、B、C、D? Pade 时延的Pade近似? Parallel 并行系统连接?

Reg 从增益矩阵中形成连续控制器和估计器?

Rmodel 产生随机连续模型? Series 串行系统连接? Ssdelete 从模型中删除输入、输出或状态? ssselect 从大系统中选择子系统? 模型变换? C2d 变连续系统为离散系统? C2dm 利用指定方法变连续为离散系统? C2dt 带一延时变连续为离散系统? D2c 变离散为连续系统? D2cm 利用指定方法变离散为连续系统? Poly 变根值表示为多项式表示? Residue 部分分式展开? Ss2tf 变状态空间表示为传递函数表示? Ss2zp 变状态空间表示为零极点表示? Tf2ss 变传递函数表示为状态空间表示? Tf2zp 变传递函数表示为零极点表示? Zp2tf 变零极点表示为传递函数表示? Zp2ss 变零极点表示为状态空间表示? 模型简化 ? Balreal平衡实现? Dbalreal 离散平衡实现? Dmodred 离散模型降阶? Minreal 最小实现和零极点对消? Modred 模型降阶? 模型实现? Canon 正则形式? Ctrbf 可控阶梯形? Obsvf 可观阶梯形? Ss2ss 采用相似变换? 模型特性

Covar 相对于白噪声的连续协方差响应? Ctrb 可控性矩阵? Damp 阻尼系数和固有频率? Dcgain 连续稳态(直流)增益? Dcovar 相对于白噪声的离散协方差响应? Ddamp 离散阻尼系数和固有频率? Ddcgain 离散系统增益? Dgram 离散可控性和可观性? Dsort 按幅值排序离散特征值? Eig 特征值和特征向量? Esort 按实部排列连续特征值? Gram 可控性和可观性? Obsv 可观性矩阵? Printsys 按格式显示系统? Roots 多项式之根? Tzero 传递零点?

Tzero2 利用随机扰动法传递零点? 时域响应?

Dimpulse 离散时间单位冲激响应? Dinitial 离散时间零输入响应? Dlsim 任意输入下的离散时间仿真? Dstep 离散时间阶跃响应?

Filter 单输入单输出Z变换仿真? Impulse 冲激响应?

Initial 连续时间零输入响应? Lsim 任意输入下的连续时间仿真? Ltitr 低级时间响应函数? Step 阶跃响应? Stepfun 阶跃函数? 频域响应?

Bode Bode图(频域响应)? Dbode 离散Bode图?

Dnichols 离散Nichols图? Dnyquist 离散Nyquist图? Dsigma 离散奇异值频域图? Fbode 连续系统的快速Bode图? Freqs 拉普拉斯变换频率响应? Freqz Z变换频率响应? Ltifr 低级频率响应函数? Margin 增益和相位裕度? Nichols Nichols图?

Ngrid 画Nichols图的栅格线? Nyquist Nyquist图? Sigma 奇异值频域图? 根轨迹?

Pzmap 零极点图?

Rlocfind 交互式地确定根轨迹增益? Rlocus 画根轨迹?

Sgrid 在网格上画连续根轨迹? Zgrid 在网格上画离散根轨迹?? 增益选择?

Acker 单输入单输出极点配置? Dlqe 离散线性二次估计器设计? Dlqew 离散线性二次估计器设计? Dlqr 离散线性二次调节器设计? Dlqry 输出加权的离散调节器设计? Lqe 线性二次估计器设计

Lqed 基于连续代价函数的离散估计器设计 Lqe2 利用Schur法设计线性二次估计器? Lqew 一般线性二次估计器设计? Lqr 线性二次调节器设计? Lqrd 基于连续代价函数的离散调节器设计? Lqry 输出加权的调节器设计? Lqr2 利用Schur法设计线性二次调节器? Place 极点配置? 方程求解? Are 代数Riccati方程求解? Dlyap 离散Lyapunov方程求解? Lyap 连续Lyapunov方程求解? Lyap2 利用对角化求解Lyapunov方程? 演示示例? Ctrldemo 控制工具箱介绍? Boildemo 锅炉系统的LQG设计? Jetdemo 喷气式飞机偏航阻尼的典型设计? Diskdemo 硬盘控制器的数字控制? Kalmdemo Kalman滤波器设计和仿真? 实用工具? Abcdchk? 检测(A、B、C、D)组的一致性? Chop 取n个重要的位置? Dexresp 离散取样响应函数?? Dfrqint 离散Bode图的自动定范围的算法? Dfrqint2 离散Nyquist图的自动定范围的算法? Dmulresp 离散多变量响应函数? Distsl 到直线间的距离? Dric 离散Riccati方程留数计算? Dsigma2 DSIGMA实用工具函数? Dtimvec 离散时间响应的自动定范围算法? Exresp 取样响应函数? Freqint Bode图的自动定范围算法? Freqint2 Nyquist图的自动定范围算法? Freqresp 低级频率响应函数? Givens 旋转? Housh 构造Householder变换? Imargin 利用内插技术求增益和相位裕度? Lab2ser 变标号为字符串? Mulresp 多变量响应函数? Nargchk 检测M文件的变量数? Perpxy 寻找最近的正交点? Poly2str 变多项式为字符串? Printmat 带行列号打印矩阵?

Ric Riccati方程留数计算? Schord 有序Schwr分解? Sigma2 SIGMA使用函数?

Tfchk 检测传递函数的一致性?

Timvec 连续时间响应的自动定范围算法? Tzreduce 在计算过零点时简化系统? Vsort 匹配两根轨迹的向量。

下载matlab机器人工具箱matlabrobotics_toolbox_demo(共5则范文)word格式文档
下载matlab机器人工具箱matlabrobotics_toolbox_demo(共5则范文).doc
将本文档下载到自己电脑,方便修改和收藏,请勿使用迅雷等下载。
点此处下载文档

文档为doc格式


声明:本文内容由互联网用户自发贡献自行上传,本网站不拥有所有权,未作人工编辑处理,也不承担相关法律责任。如果您发现有涉嫌版权的内容,欢迎发送邮件至:645879355@qq.com 进行举报,并提供相关证据,工作人员会在5个工作日内联系你,一经查实,本站将立刻删除涉嫌侵权内容。

相关范文推荐

    MATLAB实验指导书(共5篇)

    MATLAB 实验指导书 皖西学院信息工程学院 实验一 MATLAB编程环境及简单命令的执行 一、实验目的 1.熟悉MATLAB编程环境 二、实验环境 1.计算机 2.MATLAB7.0集成环境 三、实验......

    机器人论文(共5则)

    机器人的发展现状及其未来趋势 21世纪以来,国内外对机器人技术的发展越来越重视。机器人技术作为20世纪人类最伟大的发明之一,自问世以来,就一直备受瞩目。40余年来,有关它......

    机器人老师作文[共5篇]

    机器人老师作文(9篇)在现实生活或工作学习中,大家都尝试过写作文吧,作文一定要做到主题集中,围绕同一主题作深入阐述,切忌东拉西扯,主题涣散甚至无主题。相信许多人会觉得作文很......

    机器人协会总结(共5篇)

    机器人创新协会比赛总结以及以后的规划 如今的协会已经参加过了许多大型的机器人比赛,经过与其他学校的比拼之后发现我们自身还存在许多的不足,现总结入下:1、协会内没有正规的......

    未来的机器人(共5篇)

    未来的机器人 在很多年以后,地球上的人越来越多,人们产生的垃圾也越来越多,许多地方都变成了垃圾场、垃圾山。为了处理这些垃圾,科学家发明了一种专门吃垃圾的机器人。 这种机器......

    机器人总动员观后感(共5篇)

    篇一:机器人总动员观后感《机器人总动员》是一部没有多少台词,却非常值得看的影片!一部相当好的动画片。故事要从2700年说起,话说人类依靠自己的小脑袋瓜发明了各种各样的机器设......

    《机器人瓦力》(共5篇)

    《机器人瓦力》:爱与希望的力量班级:08601姓名:郭奕学号:20082043《机器人瓦力》(WALL-E)是2008年一部由安德鲁•斯坦顿编导,皮克斯动画工作室制作、迪士尼电影发行的电脑动画科幻......

    机器人概论论文(共5篇)

    论机器人 摘要:简要回顾了机器人技术的发展历程,介绍了当今世界机器人技术。并预测了今后机器人技术的发展趋势及发展策略。 关键词: 机器人,机器人技术,发展 机器人的诞生与发......