Size: px
Start display at page:

Download ""

Transcription

1 MI/CS :27 NAO Next Gen *1 ( 1A) ( 1B) 1 (A) NAO Next Gen ; (B) Webots for NAO : MI robot-simulation@ml.numericalbrain.org *1 1

2 NAO Denavit-Hartenberg (DH) : NAO :

3 : : : : 52 9 : A Python 55 B Webots for NAO 57 C 58 D NAO 59 3

4 1 1.1 M J MI/CS MI CS Webots for NAO JED Webots for NAO Webots JED 2,3 4,5,6 7 4

5 NAO V3.3 Next Gen V4 V ( ) Webots for NAO: V4 ( 1500 ) V3.3 NAO Webots for NAO NAO 2 Webots for NAO Python NAO Python C Python Python A 5

6 *2 Code Academy Python * Reza N. Jazer. Theory of Applied Robotics: Kinematics, Dynamics, and Control (2nd edition). Springer ,3 Jazer NAO Programming Guide: NAOqi modules APIs: Open Dynamics Engine (ODE) C HRP,. ( 2) ,, *2 *3 6

7 ,, NAO (Revolute joints) (Translate joints) ( ) (Dynamics) (Forward dynamics)( ) (Inverse dynamics)( ) Webot for NAO NAO

8 J1 JED 1, JED JED

9 2 2.1 Python csh (JED ) ~tyam/lectures/robot/environment.csh bash ~tyam/lectures/robot/environment.bash [tyam@blue13]$ source ~tyam/lectures/robot/environment.csh (csh ) [tyam@blue13]$ source ~tyam/lectures/robot/environment.bash (bash ) echo $SHELL [tyam@blue13]$ echo $SHELL /bin/tcsh 2.2 Webots for NAO NAO webots & [tyam@blue13]$ webots & 3 Step 2: Enter license informaiton in the Webots preferences preferences 4 Password: Network Proxy HTTP proxy: proxy.jed.uec.ac.jp:8080 OK 5 6 OK 7 System below the minimal requirements JED PC 9

10 3 Webots for NAO 4 warning OK 2.3 webotstest.py 1 webottest.py 1 #!/usr/bin/python 2 3 import sys 4 from naoqi import ALProxy 5 6 postureproxy = ALProxy("ALRobotPosture", "localhost", 9559) 10

11 5 Proxy postureproxy.gotoposture("standinit", 1.0) [tyam@blue13]$ chmod a+x./webotstest.py [tyam@blue13]$./webotstest.py NAO 1 print postureproxy.getposturelist() NAO postureproxy.gotoposture "StandInit" 11

12 7 Webots for NAO Warning PC 12

13 (Link) (Joint) (degree of freedom, DOF) (Manipulator) (Base link) (End-effector) (Actuator) (Sensor) (Controller) NAO NAO 60cm 25 2 D NAO Intel Atom Linux Wifi ssh 13

14 4 (Forward kinematics) (Global frame) G r = (X, Y, Z) (Local frame) L r = (x, y, z) 8 X Y, Z X Y, Z 8 ( ) ( ) 4.2 (Joint rotation) 3 P G r, L r G r = L r Z α : G r = Q L Z,α r (1) 14

15 X G r = Y, Z x cos α sin α 0 L r = y, Q Z,α = sin α cos α 0 (2) z Y β X γ G r = Q L Y,β r (3) G r = Q L X,γ r (4) cos β 0 sin β Q Y,β = (5) sin β 0 cos β Q X,γ = 0 cos γ sin γ (6) 0 sin γ cos γ 9 Z (A) (B) Z L r = Q 1 Z,α r (7) L r = Q 1 Y,β r (8) L r = Q 1 X,γ r (9) Q 1, Q 2,, Q n G r = G Q L L r (10) 15

16 G Q L = Q n Q 2 Q 1 (11) G Q L 1 L r = 2 X 30 Y 45 X 3 Y G r X Y = Q Y,45 Q L X,30 r = = (12) G r Y X = Q X,30 Q L Y,45 r = = (13) X (Roll) Y (Pitch) Z (Yaw) - - G Q L = Q Z,γ Q Y,β Q X,α cos β cos γ cos α sin γ + cos γ sin α sin β sin α sin γ + cos α cos γ sin β = cos β sin γ cos α cos γ + sin α sin β sin γ cos γ sin α + cos α sin β sin γ (14) sin]β cos β sin α cos α cos β ( ) α = tan 1 r32 r 33 β = sin 1 (r 31 ) ( ) γ = tan 1 r21 ( cos β 0) r 11 (15) 16

17 4.4 3 L r G d G R L : G r = G R L L r + G d (16) G R L 3 3 G r, L r, G d : G r = G T L L r (17) r 11 r 12 r 13 X 0 G T L = r 21 r 22 r 23 Y 0 r 31 r 32 r 33 Z ( G ) R = G L d 0 1 X x X 0 G r = Y Z, L r = y z, G d = Y 0 Z (18) G T L (Homogeneous transformation matrix)

18 4.7 Denavit-Hartenberg (DH) 10 10(A) X Y *4 N ( (Manipulator) ) i, i + 1 B i, B i+1 0 i + 1 l i+1 θ i+1 B i+1 i+1 r B i Z cos θ i+1 sin θ i+1 0 l i+1 cos θ i+1 i T i+1 = sin θ i+1 cos θ i+1 0 l i+1 sin θ i (19) i r = i T i+1 i+1 r (20) i X α i+1 cos θ i+1 sin θ i+1 cos α i+1 sin θ i+1 sin α i+1 l i+1 cos θ i+1 i T i+1 = sin θ i+1 cos θ i+1 cos α i+1 cos θ i sin α i+1 l i+1 sin θ i+1 0 sin α i+1 cos α i+1 0 (21) ( ) *5 *4 Z *5 1 18

19 B i i r i 1 T i i 1 r = i 1 T i i r (22) B i+1 B i+1 r B i 1 i 1 r = i 1 T i i T i+1 i r (23) j i i r = i T i+1 i+1 T i+2 j 1 T j j r (24) 1. z i i x i z i 1, z i 3. y i y i = z i x i Denavit-Hartenberg (DH ) *6 10(B) 2 B i B i 1 cos θ 2 sin θ 2 0 l2 cos θ 2 1 T 2 = sin θ 2 cos θ 2 0 l2 sin θ cos θ 1 sin θ 1 0 l1 cos θ 1 0 T 1 = sin θ 1 cos θ 1 0 l1 sin θ cos(θ 1 + θ 2 ) sin(θ 1 + θ 2 ) 0 l 1 cos θ 1 + l 2 cos(θ 1 + θ 2 ) 0 T 2 = sin(θ 1 + θ 2 ) cos(θ 1 + θ 2 ) 0 l 1 sin θ 1 + l 2 sin(θ 1 + θ 2 ) (26) (25) 4.8 1: 3 10(B) 1 3 *6 19

20 3 B 3 θ 3 l 3 2 T 3 0 T 3 0 B 3 3 r = r 2 T 3 0 T 3 0 r 4.9 NAO NAO 2 *7 1 #!/usr/local/bin/python 2 # -*- coding: utf-8 -*- 3 4 import sys 5 from naoqi import ALProxy 6 7 HOST = "localhost" 8 PORT = def main(): 2 skel.py 11 motionproxy = ALProxy("ALMotion", HOST, PORT) motionproxy.wakeup() """ """ motionproxy.rest() if name == " main ": 22 main() *7 ~tyam/lectures/robot-simulation/code/ 20

21 Webots for NAO NAO PC NAO ALProxy localhost * NAO ALMotion 11 motionproxy = ALProxy("ALMotion", HOST, PORT) NAO wakeup() NAO rest() webotstest.py StandInit 3 webotstest.py 1 #!/usr/bin/python 2 3 import sys 4 from naoqi import ALProxy 5 6 postureproxy = ALProxy("ALRobotPosture", "localhost", 9559) 7 8 postureproxy.gotoposture("standinit", 1.0) ALMotion ALRobotPosture 1 motionproxy postureproxy NAO StandZero 1 #!/usr/local/bin/python 2 # -*- coding: utf-8 -*- 3 4 import sys 5 from naoqi import ALProxy 6 import time 7 import math 8 9 HOST = "localhost" 10 PORT = naosaysno.py *8 PC IP

22 12 def main(): 13 motionproxy = ALProxy("ALMotion", HOST, PORT) motionproxy.wakeup() postureproxy = ALProxy("ALRobotPosture", "localhost", 9559) 18 postureproxy.gotoposture("standzero", 1.0) motionproxy.setangles("headyaw", -90.0*(2*math.pi/360.0), 1.0) 21 time.sleep(1.0) 22 motionproxy.setangles("headyaw", 90.0*(2*math.pi/360.0), 1.0) 23 time.sleep(1.0) 24 motionproxy.setangles("headyaw", 0, 1.0) 25 time.sleep(1.0) motionproxy.rest() if name == " main ": 30 main() wakeup() postureproxy StandZero HeadYaw setangles() 20 motionproxy.setangles("headyaw", -90.0*(2*math.pi/360.0), 1.0) -90.0*(2*math.pi/360.0) ( ) NAO 1 time.sleep(1.0) rest() HeadYaw NAO 5 getjointangles.py 1 #!/usr/local/bin/python 2 # -*- coding: utf-8 -*- 3 4 import sys 5 from naoqi import ALProxy 6 import math 7 8 HOST = "localhost" 9 PORT =

23 10 11 def main(): 12 motionproxy = ALProxy("ALMotion", HOST, PORT) motionproxy.wakeup() bodynames = motionproxy.getbodynames("body") targetanglesinrad = motionproxy.getangles("body", False) 19 targetanglesindeg = [ x * (360.0/2*math.pi) for x in targetanglesinrad ] for i in range(len(bodynames)): 22 print bodynames[i] + " = " + str(targetanglesindeg[i]) motionproxy.rest() if name == " main ": 27 main() getbodynames("body") getangles("body", False) (Radian) 19 targetanglesindeg = [ x * (360.0/2*math.pi) for x in targetanglesinrad ] (Degree) *9 for setangles 6 brave.py 1 #!/usr/local/bin/python 2 # -*- coding: utf-8 -*- 3 4 import sys 5 from naoqi import ALProxy 6 import time 7 import math 8 9 HOST = "localhost" 10 PORT = def main(): *9 Python Scheme Javascript map Lisp mapcar Ruby collect 23

24 13 motionproxy = ALProxy("ALMotion", HOST, PORT) motionproxy.wakeup() postureproxy = ALProxy("ALRobotPosture", "localhost", 9559) 19 postureproxy.gotoposture("standzero", 1.0) names = ["RShoulderRoll", "RElbowRoll", "RWristYaw"] 22 anglesindeg = [15.0, 80.0, 90.0] 23 anglesinrad = [ x * (2*math.pi/360.0) for x in anglesindeg ] 24 motionproxy.setangles(names, anglesinrad, 1.0) 25 time.sleep(2.0) motionproxy.rest() if name == " main ": 30 main() : NAO (NAO ) 11 ( ) 24

25 StandZero Z X Y 0 T T 2 1 r = T 1, 1 T 2 0 r = 0 T 1 1 T 1 2 r (27) D HandOffsetX 20mm ShoulderOffsetY 25

26 Python numpy ( ) cos(π/2) sin(π/2) A = sin(π/2) cos(π/2) (28) x = (1, 1) y = Ax = ( 1, 1) 1 #!/usr/local/bin/python 2 3 import numpy as np 4 import math 5 6 def main(): 7 8 PI = math.pi 7 rotatematrix.py 9 A = np.array([[math.cos(0.5*pi), -math.sin(0.5*pi)], 10 [math.sin(0.5*pi), math.cos(0.5*pi)]]) 11 x = np.array([[1.0], 12 [1.0]]) 13 y = np.dot(a, x) print y if name == " main ": 18 main() numpy import np np.array ( N 1 ) np.dot 0 T 1 1 T 2 26

27 5 (Inverse kinematics) ( ) (B) 2 0 T 2 = 0 T 1 1 T 2 cos(θ 1 + θ 2 ) sin(θ 1 + θ 2 ) 0 l 1 cos θ 1 + l 2 cos(θ 1 + θ 2 ) = sin(θ 1 + θ 2 ) cos(θ 1 + θ 2 ) 0 l 1 sin θ 1 + l 2 sin(θ 1 + θ 2 ) ( ) ( ) X l1 cos θ = 1 + l 2 cos(θ 1 + θ 2 ) Y l 1 sin θ 1 + l 2 sin(θ 1 + θ 2 ) (29) (30) X 2 + Y 2 = l l l 1 l 2 cos θ 2 (31) cos θ 2 = X2 + Y 2 l 2 1 l 2 2 2l 1 l 2 (32) 27

28 θ 2 = cos 1 X2 + Y 2 l 2 1 l 2 2 2l 1 l 2 (33) cos 1 (x) ( x 1 acos,asin ) tan 2 θ 2 = 1 cos θ 1 + cos θ (34) θ 2 = ±atan2 (l 1 + l 2 ) 2 (X 2 + Y 2 ) (X 2 + Y 2 ) (l 1 + l 2 ) 2 (35) θ 2 > 0 θ 1 = atan2 Y X + atan2 l 2 sin θ 2 l 1 + l 2 cos θ 2 (36) θ 2 < 0 θ 1 = atan2 Y X atan2 l 2 sin θ 2 l 1 + l 2 cos θ 2 (37) : acos,asin acos, asin asin(x) = x + 1 x x acos(x) = π (38) 2 asin(x) x 1 x 1 x 1 acos(x) cos θ = x cos 2 θ + sin 2 θ = x 2 + sin 2 θ = 1 ( ) θ = asin 1 x 2 ( ) (39) 1 x 2 1 cos 1 (x) C acos (3) glibc double glibc/sysdeps/ieee754/dbl-64/e acos.c float flt-32/e acosf.c 28

29 5.2 2 ( ) T q T = T(q) (40) q q = q δq (41) T = T (q ) (42) δt = T T (43) T δq J = T q T (q) = T (q + δq) = T (q ) + T q δq + O ( δq 2) (44) δt = T δq = Jδq (45) q J δq = J 1 δt (46) q = q + δq = q + J 1 δt (47) q (0) i q (i+1) = q (i) + J 1 ( q (i)) δt ( q (i)) (48) (Newton-Raphson Method) 2 ( ) ( ) X l1 cos θ = 1 + l 2 cos(θ 1 + θ 2 ) (49) Y l 1 sin θ 1 + l 2 sin(θ 1 + θ 2 ) 29

30 ( ) θ1 q = θ 2 ( ) (50) X T = Y J(q) J(q) = ( Ti = = ) q j ( X θ 1 Y θ 1 X θ 2 Y θ 2 ) ( l1 sin θ 1 l 2 sin(θ 1 + θ 2 ) l 2 sin(θ 1 + θ 2 ) l 1 cos θ 1 + l 2 cos(θ 1 + θ 2 ) l 2 cos(θ 1 + θ 2 ) ( ) J 1 1 l = 2 cos(θ 1 + θ 2 ) l 2 sin(θ 1 + θ 2 ) l 1 l 2 sin θ 2 l 1 cos θ 1 + l 2 cos(θ 1 + θ 2 ) l 1 sin θ 1 + l 2 sin(θ 1 + θ 2 ) ( θ1 θ 2 ) (i+1) = ( θ1 θ 2 ) (i) + J 1 [ (X Y ) ( ) ] (i) X Y ) (51) (52) (53) l 1 = l 2 = 1 (54) T q (0) = T = ( ) X = Y ( ) 1 1 ( ) (0) ( ) θ1 π/3 = θ 2 π/3 (55) (56) δt = ( 1 1) ( ) ( cos π/3 + cos(π/3 π/3) 1 = sin π/3 + sin(π/3 π/3) 1) ( 3 ) ( ) = (57) ( ) 1 J = ( ) (58) J 1 2 =

31 1 : 2 : 3 : 4 : ( ) (1) ( ) (0) θ1 θ1 = θ 2 θ 2 ( ) π/3 = = + J 1 δt + π/3 ( ( ) ( ) ). ( ) 1 J = ( 1 ) δt = ( ) q (1) = ( ) J = ( ) δt = ( ) q (2) = ( ) J = ( ) δt = ( ) q (3) = ( ) J = ( ) δt = ( ) q (4) = (59) (60) (61) (62) (63)

32 ( π/2 ) q (4) q = π/2 5.3 θ 1 ( θ 2 ) X( Y ) * 10 numpy numpy.linalg.inv() 2 8 inverse.py 1 #!/usr/bin/python 2 3 import numpy as np 4 import math 5 6 L1 = L2 = Epsilon = 1.0e def X(theta1, theta2): 11 return L1*math.cos(theta1) + L2*math.cos(theta1+theta2) def Y(theta1, theta2): 14 return L1*math.sin(theta1) + L2*math.sin(theta1+theta2) def Jacobian(q): 17 theta1 = q[0] 18 theta2 = q[1] 19 dxdtheta1 = (X(theta1+Epsilon, theta2)-x(theta1, theta2))/epsilon 20 dxdtheta2 = (X(theta1, theta2+epsilon)-x(theta1, theta2))/epsilon 21 dydtheta1 = (Y(theta1+Epsilon, theta2)-y(theta1, theta2))/epsilon 22 dydtheta2 = (Y(theta1, theta2+epsilon)-y(theta1, theta2))/epsilon 23 return np.array([[dxdtheta1, dxdtheta2], [dydtheta1, dydtheta2]]) def distance(u, v): 26 return math.sqrt((u[0]-v[0])*(u[0]-v[0])+(u[1]-v[1])*(u[1]-v[1])) def Tstar(q): 29 return np.array([[x(q[0],q[1])], [Y(q[0],q[1])]]) *10 32

33 30 31 def main(): 32 T = np.array([[1.0], [1.0]]) 33 q = np.array([[np.pi/3.0], [-np.pi/3.0]]) while distance(t, Tstar(q)) > Epsilon: 36 th1 = q[0] 37 th2 = q[1] 38 deltat = T - Tstar(q) 39 J = Jacobian(q) 40 Jinv = np.linalg.inv(j) 41 q += np.dot(jinv, deltat) 42 print q if name == " main ": 45 main() 5.4 ( 2 (2, 2)) ( ) (45): δt = Jδq (45) * 11 *11 J 33

34 5.4.1 ( ) 2/2 θ 1 = π/4, θ 2 = 0 2 2/2 ( ) J 1 1 l = 2 cos(θ 1 + θ 2 ) l 2 sin(θ 1 + θ 2 ) l 1 l 2 sin θ 2 l 1 cos θ 1 + l 2 cos(θ 1 + θ 2 ) l 1 sin θ 1 + l 2 sin(θ 1 + θ 2 ) (64) l 1 l 2 sin θ 2 (Singular configuration) : 5.5 3: 13 Nao ( ) Nao (StandInit ) ( Crouch ) StandInit (x, y, z) (x, y, z ) x = x y = y StandInit z 560 mm 450 mm = 110 mm 10 p 0, p 10 getangles() setangles() 13 StandZero θ 1 = 90 Nao θ 1 = 0 90 StandZero 34

35 13 Nao 35

36 6 IS 1 ( * 12 ) DH postureproxy.applyposture("lyingback") *

37 7 7.1 C NAO 2m 15cm NAO 2m * 13 NAO 9 walkstraight.py 1 #!/usr/local/bin/python 2 # -*- coding: utf-8 -*- 3 4 import sys 5 from naoqi import ALProxy 6 import time HOST = "localhost" 9 PORT = def main(): 12 motionproxy = ALProxy("ALMotion", HOST, PORT) postureproxy = ALProxy("ALRobotPosture", HOST, PORT) 15 postureproxy.gotoposture("standinit", 1.0) motionproxy.moveto(2.0, 0, 0) # X 2m Y 0m if name == " main ": 20 main() * 14 ( (ground reaction force)) * 15 ( (error)) (control) *13 *14 *15 JED 37

38 (Block diagram) 14 Python NAO NAO NAO Python PID PID t e(t) Q(t) PID (PID control) Q(t) = k P e(t) + k I t 0 e(t)dt + k D de dt (65) P (Proportional) I (Integral) D (Derivative) k P, k I, k D P I D P 0 0 P (PI ) t e(t) t + t e(t + t) e(t) + de t (66) dt 38

39 P (PD ) : DC NAO setanglees() NAO DC 15(A) 15 DC (A) (B) 0 θ d (t) = θ d u(t) θ d u(t) u(t) = { 1 t > 0 0 θ(t) ˆθ(s) = (ˆθd Ĝ(s)Ĥ(s) (s) ˆθ(s) ) (67) (68) ˆθ(s) = Ĝ(s)Ĥ(s) 1 + Ĝ(s)Ĥ(s) ˆθd (s) (69) Ĝ(s) Ĥ(s) P Ĝ(s) = k p Ĥ(s) Ĥ(s) = K s(t s + 1) (70) * 16 K, T ˆθ d (s) = θ d /s *16 (1999). MATLAB. 39

40 ˆθ(s) = = k p K s(t s+1) θ d K 1 + k p s s(t s+1) k p K s(t s + 1) + k p K θ d k p K θ d s = s(t s 2 + s + k p K) 1 = θ d k p K s(s a)(s b) (71) a, b 2 T s 2 + s + k p K = 0 a, b = 1 ± 1 4T Kk p 2T (72) θ d (t) = θ d Θ(t) θ(t) (α, β, γ ) 1 ˆθ(s) = θ d k p K s(s a)(s b) ( α = θ d k p K s + β s a + γ ) (73) s b θ(t) = k p Kθ d ( αu(t) + βe at + γe bt) (74) 1. k p < 1/(4T K) 1 4T Kk p 1 a, b θ(t) k p Kαθ d u(t) θ d ( α = 1/(k p K)) (75) k p 2. k p > 1/(4T K) 1 4T Kk p ωi ( θ(t) = k p Kθ d αu(t) + βe ( 1/(2T )+iω/(2t ))t ( 1/(2T ) iω/(2t + γe ))t) ( (76) = k p Kθ d αu(t) + βe t/(2t ) e iωt/(2t ) + γe t/(2t ) iωt/(2t e )) θ(t) 40

41 7.3 4: P 1 1 τ dy dt = y(t) + z(t) (77) τ t z(t) y(t) 1 τ 1 ( 16) H(t) z(t) y(t) time (s) 16 z(t)( ) y(t)( ) (s) τ = 0.1 (s) z(t), y(t) ẑ(s), ŷ(s) ( ) Ĥ(s) = 1/(sτ + 1) ŷ(s) = 1 (78) sτ + 1ẑ(s) 17 PID 41

42 17 PI e(t) = x(t) y(t) t z(t) = k P e(t) + k I e(t)dt (79) x(t) ( ) Ĝ(s) = K P + K I /s 17 0 ẑ(s) = k P ê(s) + K I ê(s) (80) s ŷ(s) = G(s)H(s) (ˆx(s) ŷ(s)) = G(s)H(s) 1 + G(s)H(s) ˆx(s) (81) G(s)H(s) 1+G(s)H(s) ˆx(s) ŷ(s) G(s)H(s) 1 + G(s)H(s) = (K P + K I /s)(1/(sτ + 1)) 1 + (K P + K I /s)(1/(sτ + 1)) K P + K I /s = (sτ + 1) + (K P + K I /s) K P = (sτ + 1) + (K P + K I /s) + K I /s (sτ + 1) + (K P + K I /s) K P s K I = s 2 + τ + (1 + K P )s + K I s 2 τ + (1 + K P )s + K I ) (82) P G(s)H(s) 1 + G(s)H(s) = K P sτ K P (83) x(t) t = 0 a x(t) = au(t) * 17 (84) u(t) u(t) = { 1 t 0 0 (85) *17 au 42

43 ˆx(s) ( ) ˆx(s) = a 1 s (86) K P ŷ(s) = a s 2 + a τ + (1 + K P )s + K I s (s 2 τ + (1 + K P )s + K I )) K I (87) P K P ŷ(s) = a s(sτ K P ) (88) ( (85)) y(t) P P K P ŷ(s) = a s(sτ K P ) = ak P 1 τ s(s + (1 + K P )/τ)) = ak ( ) P 1 1 τ (1 + K p )/τ s 1 s + (1 + K P )/τ = ak ( ) P 1 (1 + K p ) s 1 s + (1 + K P )/τ (L 1 [1/(s + a)] = e at ) y(t) = ak P (u(t) ) + e 1+K p τ t (1 + K p ) = ak P (1 + K p ) u(t) + ak P (1 + K p ) e 1+Kp τ t (89) (90) 2 y(t) ak P (1 + K p ) (91) a P K P /(1 + K P ) 1 P K P ( ) (a): pid.py 1 PID Ki=0, Kd=0 Kp gnuplot K P 43

44 10 pi.py 1 #!/usr/local/bin/python 2 # -*- coding: utf-8 -*- 3 4 import math 5 6 def main(): 7 8 Dt = # \Delta t = 1 ms 9 Tau = 0.1 # \tau = 100 ms 10 Kp = 1.0 # proportional control gain parameter 11 Ki = 0.0 # integral control gain parameter 12 Kd = 0.0 # difference control gain parameter y = 0 # output 15 e = 0 # error 16 ei = 0 # integral of error 17 e_prev = 0 # old value of error 18 x = 1.0 # desired output for i in range(1000): 21 t = Dt*i # time 22 print str(t) + " " + str(y) 23 e_prev = e 24 e = x - y # error 25 ei += Dt*(e + e_prev)/2.0 # integral of error with averaging 26 ed = (e - e_prev)/dt # difference of error 27 dy = (Dt/Tau)*(-y + (Kp*e + Ki*ei + Kd*ed)) # compute difference, PID control 28 y += dy # forward Euler method if name == " main ": 31 main() PI PI (b): pi.py Ki Ki gnuplot K I (c): 44

45 P (b) P 2 1/s x(t) = a τ dy dt = y(t) + a (92) y(t) = a PID (d): (d) Kd 7.4 NAO 2 1 #!/usr/local/bin/python 2 # -*- coding: utf-8 -*- 3 4 import sys 5 from naoqi import ALProxy 6 import time HOST = "localhost" 9 PORT = def main(): 11 balldetection 12 motionproxy = ALProxy("ALMotion", HOST, PORT) postureproxy = ALProxy("ALRobotPosture", HOST, PORT) 15 postureproxy.gotoposture("standinit", 1.0) memoryproxy = ALProxy("ALMemory", HOST, PORT) 18 45

46 19 redballdetectionproxy = ALProxy("ALRedBallDetection", HOST, PORT) 20 redballdetectionproxy.subscribe("foo") videodeviceproxy = ALProxy("ALVideoDevice", HOST, PORT) 23 videodeviceproxy.subscribe("bar", 0, 0, 5) j = 0 26 for i in range(60): 27 ballinfo = memoryproxy.getdata("redballdetected") 28 videodeviceproxy.setactivecamera(j) 29 j = (j+1)%2 30 if ballinfo!= None: 31 print ballinfo[1] 32 time.sleep(1.0) redballdetectionproxy.unsubscribe("foo") 35 videodeviceproxy.unsubscribe("bar") time.sleep(1.0) motionproxy.rest() if name == " main ": 42 main() 2 1 * 18 [ X, Y, X, X ] 18 ( ) B turnmotion.py 1 #!/usr/local/bin/python *

47 18 2 # -*- coding: utf-8 -*- 3 4 import sys 5 import math 6 import time 7 8 def turnleftpose(angleindeg): 9 poselist = [[["RAnkleRoll", "LAnkleRoll", "RHipRoll", "LHipRoll"], 10 [-5.0, -5.0, 5.0, 5.0]], 11 [["RAnkleRoll", "LAnkleRoll"], 12 [-10.0, -10.0]], 13 [["LHipYawPitch"], 14 [-angleindeg]], 15 [["RAnkleRoll", "LAnkleRoll", "RHipRoll", "LHipRoll"], 16 [0.0, 0.0, 0.0, 0.0]], 17 [["RAnkleRoll", "LAnkleRoll", "RHipRoll", "LHipRoll"], 18 [5.0, 5.0, -5.0, -5.0]], 19 [["RAnkleRoll", "LAnkleRoll"], 20 [10.0, 10.0]], 21 [["LHipYawPitch"], 22 [0.0]], 23 [["RAnkleRoll", "LAnkleRoll", "RHipRoll", "LHipRoll"], 24 [0.0, 0.0, 0.0, 0.0]]] 25 return poselist def turnrightpose(angleindeg): 28 poselist = [[["LAnkleRoll", "RAnkleRoll", "LHipRoll", "RHipRoll"], 29 [5.0, 5.0, -5.0, -5.0]], 30 [["LAnkleRoll", "RAnkleRoll"], 31 [10.0, 10.0]], 47

48 32 [["LHipYawPitch"], # only LHipYawPitch is movable 33 [-angleindeg]], 34 [["LAnkleRoll", "RAnkleRoll", "LHipRoll", "RHipRoll"], 35 [0.0, 0.0, 0.0, 0.0]], 36 [["LAnkleRoll", "RAnkleRoll", "LHipRoll", "RHipRoll"], 37 [-5.0, -5.0, 5.0, 5.0]], 38 [["LAnkleRoll", "RAnkleRoll"], 39 [-10.0, -10.0]], 40 [["LHipYawPitch"], 41 [0.0]], 42 [["LAnkleRoll", "RAnkleRoll", "LHipRoll", "RHipRoll"], 43 [0.0, 0.0, 0.0, 0.0]]] 44 return poselist def turnbysetangles(motionproxy, direction, angleindeg): 47 if direction == "Left": 48 poselist = turnleftpose(angleindeg) 49 else: 50 poselist = turnrightpose(angleindeg) for pose in poselist: 53 names = pose[0] 54 anglesindeg = pose[1] 55 anglesinrad = [ x * (2*math.pi/360.0) for x in anglesindeg ] 56 motionproxy.setangles(names, anglesinrad, 1.0) 57 time.sleep(0.1) 58 time.sleep(1.0) 13 turn.py 1 #!/usr/local/bin/python 2 # -*- coding: utf-8 -*- 3 4 import sys 5 from naoqi import ALProxy 6 import time 7 import math 8 import turnmotion 9 10 HOST = "localhost" #"localhost" 11 PORT = def main(): 14 motionproxy = ALProxy("ALMotion", HOST, PORT) motionproxy.wakeup() 48

49 17 18 postureproxy = ALProxy("ALRobotPosture", HOST, 9559) postureproxy.gotoposture("standinit", 1.0) turnangleindeg = for i in range(10): 24 turnmotion.turnbysetangles(motionproxy, "Left", turnangleindeg) 25 for i in range(10): 26 turnmotion.turnbysetangles(motionproxy, "Right", turnangleindeg) time.sleep(3.0) motionproxy.rest() if name == " main ": 33 main() NAO 14 turntoball.py 1 #!/usr/local/bin/python 2 # -*- coding: utf-8 -*- 3 4 import sys 5 from naoqi import ALProxy 6 import time 7 import math 8 import turnmotion 9 10 HOST = "localhost" 11 PORT = def main(): 14 motionproxy = ALProxy("ALMotion", HOST, PORT) 15 motionproxy.wakeup() postureproxy = ALProxy("ALRobotPosture", HOST, 9559) 18 postureproxy.gotoposture("standinit", 1.0) memoryproxy = ALProxy("ALMemory", HOST, PORT) 21 49

50 22 redballdetectionproxy = ALProxy("ALRedBallDetection", HOST, PORT) 23 redballdetectionproxy.subscribe("foo") videodeviceproxy = ALProxy("ALVideoDevice", HOST, PORT) 26 videodeviceproxy.subscribe("bar", 0, 0, 5) error = 0.3 # artibrary number 29 Kp = 0.5 # gain parameter 30 for i in range(30): 31 if abs(error) == 0.0: 32 break 33 for j in range(2): 34 videodeviceproxy.setactivecamera(j) 35 ballinfo = memoryproxy.getdata("redballdetected") 36 if ballinfo!= None: 37 error = ballinfo[1][0] 38 print error 39 if float(error) > 0: 40 turnmotion.turnbysetangles(motionproxy, "Left", Kp*float(error 41 else: )*(180.0/math.pi)) 42 turnmotion.turnbysetangles(motionproxy, "Right", Kp*abs(float(error ))*(180.0/math.pi)) 43 time.sleep(1.0) redballdetectionproxy.unsubscribe("foo") 46 videodeviceproxy.unsubscribe("bar") 47 motionproxy.rest() if name == " main ": 50 main() :

51 7.8.2 NAO 2m 15cm 10cm ( ) 51

52 8 : NAO NAO 15cm 52

53 9 : NAO 2m 2m 15cm NAO 53

54 10 * 19 *19 54

55 A Python Hello world 15 its.py 1 #!/usr/local/bin/python 2 # -*- coding: utf-8 -*- 3 4 import sys 5 import time 6 7 def main(): 8 print "And now for something completely different..." 9 time.sleep(3.0) 10 for i in ["Graham Chapman", "John Cleese", "Terry Gilliam", 11 "Eric Idle", "Terry Jones", "Michael Palin"]: 12 print i if name == " main ": 15 main() ( UTF8) C #include<stdio.h> 5. 5 time * main C main Python (:) * And now for something complete different... * 22 C (;) C {} Python 9. 9 time sleep C sleep 3 *20 C *21 *22 Monty Python s Flying Circus ( ) The Olympic Hide-and-Seek Final YouTube ( ) 55

56 for C Python [] (:) import false main() for C range() 0 ( 1) 1 % python 2 Python (v2.7.5:ab05e7dd2788, May , 13:18:45) 3 [GCC (Apple Inc. build 5666) (dot 3)] on darwin 4 Type "help", "copyright", "credits" or "license" for more information. 5 >>> range(10) 6 [0, 1, 2, 3, 4, 5, 6, 7, 8, 9] 7 >>> for i in range(10): 8... print i 9... ^D >>> 1 # # (C //) 2 """ 3 """ """ (C /*... */) 4 """ (/* foo */ """ foo """ ) 5 """ 56

57 B Webots for NAO View Ctrl Shift Webots Console 1 [naoqisim] [INFO ] NAOqi is ready... 2 [naoqisim] [INFO ] entSyncPlugin: End decrease stiffness 57

58 C ~tyam/lectures/robot/nao-control.wbt Webots for NAO File Open File... nao-control.wbt * 23 15cm NAO 2m NAO *23 SceneTree ( SpherecalSkyDome) Add a new object Add a node PROTO objects robocup spl Ball (Solid) Add (0,0,0) SceneTree Ball 58

59 D NAO NAO NAO Technical overview * *24 robots.html 59

60 21 60

61 22 61

62 23 62

63 63 24

64 25 64

65 26 65

66 27 66

:56 1 (Forward kinematics) (Global frame) G r = (X, Y, Z) (Local frame) L r = (x, y, z) 1 X Y, Z X Y, Z 1 ( ) ( ) 1.2 (Joint rotati

:56 1 (Forward kinematics) (Global frame) G r = (X, Y, Z) (Local frame) L r = (x, y, z) 1 X Y, Z X Y, Z 1 ( ) ( ) 1.2 (Joint rotati 2013.09.21 17:56 1 (Forward kinematics) 1.1 2 (Global frame) G r (X, Y, Z) (Local frame) L r (x, y, z) 1 X Y, Z X Y, Z 1 ( ) ( ) 1.2 (Joint rotation) 3 P G r, L r G r L r Z α : G r Q L Z,α r (1) 1 G r

More information

,, 2. Matlab Simulink 2018 PC Matlab Scilab 2

,, 2. Matlab Simulink 2018 PC Matlab Scilab 2 (2018 ) ( -1) TA Email : ohki@i.kyoto-u.ac.jp, ske.ta@bode.amp.i.kyoto-u.ac.jp : 411 : 10 308 1 1 2 2 2.1............................................ 2 2.2..................................................

More information

TOP URL 1

TOP URL   1 TOP URL http://amonphys.web.fc.com/ 3.............................. 3.............................. 4.3 4................... 5.4........................ 6.5........................ 8.6...........................7

More information

Excel ではじめる数値解析 サンプルページ この本の定価 判型などは, 以下の URL からご覧いただけます. このサンプルページの内容は, 初版 1 刷発行時のものです.

Excel ではじめる数値解析 サンプルページ この本の定価 判型などは, 以下の URL からご覧いただけます.   このサンプルページの内容は, 初版 1 刷発行時のものです. Excel ではじめる数値解析 サンプルページ この本の定価 判型などは, 以下の URL からご覧いただけます. http://www.morikita.co.jp/books/mid/009631 このサンプルページの内容は, 初版 1 刷発行時のものです. Excel URL http://www.morikita.co.jp/books/mid/009631 i Microsoft Windows

More information

<4D F736F F D B B83578B6594BB2D834A836F815B82D082C88C60202E646F63>

<4D F736F F D B B83578B6594BB2D834A836F815B82D082C88C60202E646F63> MATLAB/Simulink による現代制御入門 サンプルページ この本の定価 判型などは, 以下の URL からご覧いただけます. http://www.morikita.co.jp/books/mid/9241 このサンプルページの内容は, 初版 1 刷発行当時のものです. i MATLAB/Simulink MATLAB/Simulink 1. 1 2. 3. MATLAB/Simulink

More information

2012 September 21, 2012, Rev.2.2

2012 September 21, 2012, Rev.2.2 212 September 21, 212, Rev.2.2 4................. 4 1 6 1.1.................. 6 1.2.................... 7 1.3 s................... 8 1.4....................... 9 1.5..................... 11 2 12 2.1.........................

More information

85 4

85 4 85 4 86 Copright c 005 Kumanekosha 4.1 ( ) ( t ) t, t 4.1.1 t Step! (Step 1) (, 0) (Step ) ±V t (, t) I Check! P P V t π 54 t = 0 + V (, t) π θ : = θ : π ) θ = π ± sin ± cos t = 0 (, 0) = sin π V + t +V

More information

Gmech08.dvi

Gmech08.dvi 51 5 5.1 5.1.1 P r P z θ P P P z e r e, z ) r, θ, ) 5.1 z r e θ,, z r, θ, = r sin θ cos = r sin θ sin 5.1) e θ e z = r cos θ r, θ, 5.1: 0 r

More information

08-Note2-web

08-Note2-web r(t) t r(t) O v(t) = dr(t) dt a(t) = dv(t) dt = d2 r(t) dt 2 r(t), v(t), a(t) t dr(t) dt r(t) =(x(t),y(t),z(t)) = d 2 r(t) dt 2 = ( dx(t) dt ( d 2 x(t) dt 2, dy(t), dz(t) dt dt ), d2 y(t) dt 2, d2 z(t)

More information

¥×¥í¥°¥é¥ß¥ó¥°±é½¬I Exercise on Programming I [1zh] ` `%%%`#`&12_`__~~~ alse

¥×¥í¥°¥é¥ß¥ó¥°±é½¬I  Exercise on Programming I [1zh] ` `%%%`#`&12_`__~~~alse I Exercise on Programming I http://bit.ly/oitprog1 1, 2 of 14 ( RD S ) I 1, 2 of 14 1 / 44 Ruby Ruby ( RD S ) I 1, 2 of 14 2 / 44 7 5 9 2 9 3 3 2 6 5 1 3 2 5 6 4 7 8 4 5 2 7 9 6 4 7 1 3 ( RD S ) I 1, 2

More information

chap1.dvi

chap1.dvi 1 1 007 1 e iθ = cos θ + isin θ 1) θ = π e iπ + 1 = 0 1 ) 3 11 f 0 r 1 1 ) k f k = 1 + r) k f 0 f k k = 01) f k+1 = 1 + r)f k ) f k+1 f k = rf k 3) 1 ) ) ) 1+r/)f 0 1 1 + r/) f 0 = 1 + r + r /4)f 0 1 f

More information

. (.8.). t + t m ü(t + t) + c u(t + t) + k u(t + t) = f(t + t) () m ü f. () c u k u t + t u Taylor t 3 u(t + t) = u(t) + t! u(t) + ( t)! = u(t) + t u(

. (.8.). t + t m ü(t + t) + c u(t + t) + k u(t + t) = f(t + t) () m ü f. () c u k u t + t u Taylor t 3 u(t + t) = u(t) + t! u(t) + ( t)! = u(t) + t u( 3 8. (.8.)............................................................................................3.............................................4 Nermark β..........................................

More information

数値計算:常微分方程式

数値計算:常微分方程式 ( ) 1 / 82 1 2 3 4 5 6 ( ) 2 / 82 ( ) 3 / 82 C θ l y m O x mg λ ( ) 4 / 82 θ t C J = ml 2 C mgl sin θ θ C J θ = mgl sin θ = θ ( ) 5 / 82 ω = θ J ω = mgl sin θ ω J = ml 2 θ = ω, ω = g l sin θ = θ ω ( )

More information

( ) kadai4, kadai4.zip.,. 3 cos x [ π, π] Python. ( 100 ), x cos x ( ). (, ). def print cos(): print cos()

( ) kadai4, kadai4.zip.,. 3 cos x [ π, π] Python. ( 100 ), x cos x ( ). (, ). def print cos(): print cos() 4 2010.6 1 :, HP.. HP 4 (, PGM/PPM )., python,,, 2, kadai4,.,,, ( )., ( ) N, exn.py ( 3 ex3.py ). N 3.., ( )., ( ) N, (exn.txt).. 1 ( ) kadai4, kadai4.zip.,. 3 cos x [ π, π] Python. ( 100 ), x cos x (

More information

Sgr.A 2 saida@daido-it.a.jp Sgr.A 1 3 1.1 2............................................. 3 1.2.............................. 4 2 1 6 2.1................................. 6 2.2...................................

More information

ẍ = kx, (k > ) (.) x x(t) = A cos(ωt + α) (.). d/ = D. d dt x + k ( x = D + k ) ( ) ( ) k k x = D + i D i x =... ( ) k D + i x = or ( ) k D i x =.. k.

ẍ = kx, (k > ) (.) x x(t) = A cos(ωt + α) (.). d/ = D. d dt x + k ( x = D + k ) ( ) ( ) k k x = D + i D i x =... ( ) k D + i x = or ( ) k D i x =.. k. K E N Z OU 8 9 8. F = kx x 3 678 ẍ = kx, (k > ) (.) x x(t) = A cos(ωt + α) (.). d/ = D. d dt x + k ( x = D + k ) ( ) ( ) k k x = D + i D i x =... ( ) k D + i x = or ( ) k D i x =.. k. D = ±i dt = ±iωx,

More information

鉄鋼協会プレゼン

鉄鋼協会プレゼン NN :~:, 8 Nov., Adaptive H Control for Linear Slider with Friction Compensation positioning mechanism moving table stand manipulator Point to Point Control [G] Continuous Path Control ground Fig. Positoining

More information

1. ( ) 1.1 t + t [m]{ü(t + t)} + [c]{ u(t + t)} + [k]{u(t + t)} = {f(t + t)} (1) m ü f c u k u 1.2 Newmark β (1) (2) ( [m] + t ) 2 [c] + β( t)2

1. ( ) 1.1 t + t [m]{ü(t + t)} + [c]{ u(t + t)} + [k]{u(t + t)} = {f(t + t)} (1) m ü f c u k u 1.2 Newmark β (1) (2) ( [m] + t ) 2 [c] + β( t)2 212 1 6 1. (212.8.14) 1 1.1............................................. 1 1.2 Newmark β....................... 1 1.3.................................... 2 1.4 (212.8.19)..................................

More information

24 I ( ) 1. R 3 (i) C : x 2 + y 2 1 = 0 (ii) C : y = ± 1 x 2 ( 1 x 1) (iii) C : x = cos t, y = sin t (0 t 2π) 1.1. γ : [a, b] R n ; t γ(t) = (x

24 I ( ) 1. R 3 (i) C : x 2 + y 2 1 = 0 (ii) C : y = ± 1 x 2 ( 1 x 1) (iii) C : x = cos t, y = sin t (0 t 2π) 1.1. γ : [a, b] R n ; t γ(t) = (x 24 I 1.1.. ( ) 1. R 3 (i) C : x 2 + y 2 1 = 0 (ii) C : y = ± 1 x 2 ( 1 x 1) (iii) C : x = cos t, y = sin t (0 t 2π) 1.1. γ : [a, b] R n ; t γ(t) = (x 1 (t), x 2 (t),, x n (t)) ( ) ( ), γ : (i) x 1 (t),

More information

基礎から学ぶトラヒック理論 サンプルページ この本の定価 判型などは, 以下の URL からご覧いただけます. このサンプルページの内容は, 初版 1 刷発行時のものです.

基礎から学ぶトラヒック理論 サンプルページ この本の定価 判型などは, 以下の URL からご覧いただけます.   このサンプルページの内容は, 初版 1 刷発行時のものです. 基礎から学ぶトラヒック理論 サンプルページ この本の定価 判型などは, 以下の URL からご覧いただけます. http://www.morikita.co.jp/books/mid/085221 このサンプルページの内容は, 初版 1 刷発行時のものです. i +α 3 1 2 4 5 1 2 ii 3 4 5 6 7 8 9 9.3 2014 6 iii 1 1 2 5 2.1 5 2.2 7

More information

II Karel Švadlenka * [1] 1.1* 5 23 m d2 x dt 2 = cdx kx + mg dt. c, g, k, m 1.2* u = au + bv v = cu + dv v u a, b, c, d R

II Karel Švadlenka * [1] 1.1* 5 23 m d2 x dt 2 = cdx kx + mg dt. c, g, k, m 1.2* u = au + bv v = cu + dv v u a, b, c, d R II Karel Švadlenka 2018 5 26 * [1] 1.1* 5 23 m d2 x dt 2 = cdx kx + mg dt. c, g, k, m 1.2* 5 23 1 u = au + bv v = cu + dv v u a, b, c, d R 1.3 14 14 60% 1.4 5 23 a, b R a 2 4b < 0 λ 2 + aλ + b = 0 λ =

More information

214 March 31, 214, Rev.2.1 4........................ 4........................ 5............................. 7............................... 7 1 8 1.1............................... 8 1.2.......................

More information

mt_4.dvi

mt_4.dvi ( ) 2006 1 PI 1 1 1.1................................. 1 1.2................................... 1 2 2 2.1...................................... 2 2.1.1.......................... 2 2.1.2..............................

More information

213 March 25, 213, Rev.1.5 4........................ 4........................ 6 1 8 1.1............................... 8 1.2....................... 9 2 14 2.1..................... 14 2.2............................

More information

Note.tex 2008/09/19( )

Note.tex 2008/09/19( ) 1 20 9 19 2 1 5 1.1........................ 5 1.2............................. 8 2 9 2.1............................. 9 2.2.............................. 10 3 13 3.1.............................. 13 3.2..................................

More information

x A Aω ẋ ẋ 2 + ω 2 x 2 = ω 2 A 2. (ẋ, ωx) ζ ẋ + iωx ζ ζ dζ = ẍ + iωẋ = ẍ + iω(ζ iωx) dt dζ dt iωζ = ẍ + ω2 x (2.1) ζ ζ = Aωe iωt = Aω cos ωt + iaω sin

x A Aω ẋ ẋ 2 + ω 2 x 2 = ω 2 A 2. (ẋ, ωx) ζ ẋ + iωx ζ ζ dζ = ẍ + iωẋ = ẍ + iω(ζ iωx) dt dζ dt iωζ = ẍ + ω2 x (2.1) ζ ζ = Aωe iωt = Aω cos ωt + iaω sin 2 2.1 F (t) 2.1.1 mẍ + kx = F (t). m ẍ + ω 2 x = F (t)/m ω = k/m. 1 : (ẋ, x) x = A sin ωt, ẋ = Aω cos ωt 1 2-1 x A Aω ẋ ẋ 2 + ω 2 x 2 = ω 2 A 2. (ẋ, ωx) ζ ẋ + iωx ζ ζ dζ = ẍ + iωẋ = ẍ + iω(ζ iωx) dt dζ

More information

listings-ext

listings-ext (6) Python (2) ( ) ohsaki@kwansei.ac.jp 5 Python (2) 1 5.1 (statement)........................... 1 5.2 (scope)......................... 11 5.3 (subroutine).................... 14 5 Python (2) Python 5.1

More information

analog-control-mod : 2007/2/4(8:44) 2 E8 P M () r e K P ( ) T I u K M T M K D E8.: DC PID K D E8. (E8.) P M () E8.2 K P D () ( T ) (E8.2) K M T M K, T

analog-control-mod : 2007/2/4(8:44) 2 E8 P M () r e K P ( ) T I u K M T M K D E8.: DC PID K D E8. (E8.) P M () E8.2 K P D () ( T ) (E8.2) K M T M K, T analog-control-mod : 2007/2/4(8:44) E8 E8. PID DC. PID 2. DC PID 3. E8.2 DC PID C8 E8. DC PID E6 DC P M () K M ( T M ) (E8.) DC PID C8 E8. r e u E8.2 PID E8. PID analog-control-mod : 2007/2/4(8:44) 2 E8

More information

December 28, 2018

December 28, 2018 e-mail : kigami@i.kyoto-u.ac.jp December 28, 28 Contents 2............................. 3.2......................... 7.3..................... 9.4................ 4.5............. 2.6.... 22 2 36 2..........................

More information

I, II 1, A = A 4 : 6 = max{ A, } A A 10 10%

I, II 1, A = A 4 : 6 = max{ A, } A A 10 10% 1 2006.4.17. A 3-312 tel: 092-726-4774, e-mail: hara@math.kyushu-u.ac.jp, http://www.math.kyushu-u.ac.jp/ hara/lectures/lectures-j.html Office hours: B A I ɛ-δ ɛ-δ 1. 2. A 1. 1. 2. 3. 4. 5. 2. ɛ-δ 1. ɛ-n

More information

重力方向に基づくコントローラの向き決定方法

重力方向に基づくコントローラの向き決定方法 ( ) 2/Sep 09 1 ( ) ( ) 3 2 X w, Y w, Z w +X w = +Y w = +Z w = 1 X c, Y c, Z c X c, Y c, Z c X w, Y w, Z w Y c Z c X c 1: X c, Y c, Z c Kentaro Yamaguchi@bandainamcogames.co.jp 1 M M v 0, v 1, v 2 v 0 v

More information

211 kotaro@math.titech.ac.jp 1 R *1 n n R n *2 R n = {(x 1,..., x n ) x 1,..., x n R}. R R 2 R 3 R n R n R n D D R n *3 ) (x 1,..., x n ) f(x 1,..., x n ) f D *4 n 2 n = 1 ( ) 1 f D R n f : D R 1.1. (x,

More information

<4D F736F F D B B83578B6594BB2D834A836F815B82D082C88C60202E646F63>

<4D F736F F D B B83578B6594BB2D834A836F815B82D082C88C60202E646F63> 単純適応制御 SAC サンプルページ この本の定価 判型などは, 以下の URL からご覧いただけます. http://www.morikita.co.jp/books/mid/091961 このサンプルページの内容は, 初版 1 刷発行当時のものです. 1 2 3 4 5 9 10 12 14 15 A B F 6 8 11 13 E 7 C D URL http://www.morikita.co.jp/support

More information

Python Speed Learning

Python   Speed Learning Python Speed Learning 1 / 89 1 2 3 4 (import) 5 6 7 (for) (if) 8 9 10 ( ) 11 12 for 13 2 / 89 Contents 1 2 3 4 (import) 5 6 7 (for) (if) 8 9 10 ( ) 11 12 for 13 3 / 89 (def) (for) (if) etc. 1 4 / 89 Jupyter

More information

曲面のパラメタ表示と接線ベクトル

曲面のパラメタ表示と接線ベクトル L11(2011-07-06 Wed) :Time-stamp: 2011-07-06 Wed 13:08 JST hig 1,,. 2. http://hig3.net () (L11) 2011-07-06 Wed 1 / 18 ( ) 1 V = (xy2 ) x + (2y) y = y 2 + 2. 2 V = 4y., D V ds = 2 2 ( ) 4 x 2 4y dy dx =

More information

2019 1 5 0 3 1 4 1.1.................... 4 1.1.1......................... 4 1.1.2........................ 5 1.1.3................... 5 1.1.4........................ 6 1.1.5......................... 6 1.2..........................

More information

Microsoft Word - D JP.docx

Microsoft Word - D JP.docx Application Service Gateway Thunder/AX Series vthunder ライセンスキー インストール 手順 1 1.... 3 2. vthunder... 3 3. ACOS... 3 4. ID... 5 5.... 8 6.... 8 61... 8 62 GUI... 10 2 1. 概要 2. vthunder へのアクセス 方法 SSHHTTPSvThunder

More information

#A A A F, F d F P + F P = d P F, F y P F F x A.1 ( α, 0), (α, 0) α > 0) (x, y) (x + α) 2 + y 2, (x α) 2 + y 2 d (x + α)2 + y 2 + (x α) 2 + y 2 =

#A A A F, F d F P + F P = d P F, F y P F F x A.1 ( α, 0), (α, 0) α > 0) (x, y) (x + α) 2 + y 2, (x α) 2 + y 2 d (x + α)2 + y 2 + (x α) 2 + y 2 = #A A A. F, F d F P + F P = d P F, F P F F A. α, 0, α, 0 α > 0, + α +, α + d + α + + α + = d d F, F 0 < α < d + α + = d α + + α + = d d α + + α + d α + = d 4 4d α + = d 4 8d + 6 http://mth.cs.kitmi-it.c.jp/

More information

pdf

pdf http://www.ns.kogakuin.ac.jp/~ft13389/lecture/physics1a2b/ pdf I 1 1 1.1 ( ) 1. 30 m µm 2. 20 cm km 3. 10 m 2 cm 2 4. 5 cm 3 km 3 5. 1 6. 1 7. 1 1.2 ( ) 1. 1 m + 10 cm 2. 1 hr + 6400 sec 3. 3.0 10 5 kg

More information

2015 I ( TA)

2015 I ( TA) 2015 I ( TA) Schrödinger PDE Python u(t, x) x t 2 u(x, t) = k u(t, x) t x2 k k = i h 2m Schrödinger h m 1 ψ(x, t) i h ( 1 ψ(x, t) = i h ) 2 ψ(x, t) t 2m x Cauchy x : x Fourier x x Fourier 2 u(x, t) = k

More information

p06.dvi

p06.dvi I 6 : 1 (1) u(t) y(t) : n m a n i y (i) = b m i u (i) i=0 i=0 t, y (i) y i (u )., a 0 0, b 0 0. : 2 (2), Laplace, (a 0 s n +a 1 s n 1 + +a n )Y(s) = (b 0 s m + b 1 s m 1 + +b m )U(s),, Y(s) U(s) = b 0s

More information

振動と波動

振動と波動 Report JS0.5 J Simplicity February 4, 2012 1 J Simplicity HOME http://www.jsimplicity.com/ Preface 2 Report 2 Contents I 5 1 6 1.1..................................... 6 1.2 1 1:................ 7 1.3

More information

K E N Z OU

K E N Z OU K E N Z OU 11 1 1 1.1..................................... 1.1.1............................ 1.1..................................................................................... 4 1.........................................

More information

1 1.1 H = µc i c i + c i t ijc j + 1 c i c j V ijklc k c l (1) V ijkl = V jikl = V ijlk = V jilk () t ij = t ji, V ijkl = V lkji (3) (1) V 0 H mf = µc

1 1.1 H = µc i c i + c i t ijc j + 1 c i c j V ijklc k c l (1) V ijkl = V jikl = V ijlk = V jilk () t ij = t ji, V ijkl = V lkji (3) (1) V 0 H mf = µc 013 6 30 BCS 1 1.1........................ 1................................ 3 1.3............................ 3 1.4............................... 5 1.5.................................... 5 6 3 7 4 8

More information

5. 5.1,, V, ,, ( 5.1), 5.2.2,,,,,,,,,, 5.2.3, 5.2 L1, L2, L3 3-1, 2-2, 1-3,,, L1, L3, L2, ,,, ( 5.3),,, N 3 L 2 S L 1 L 3 5.1: 5.2: 1

5. 5.1,, V, ,, ( 5.1), 5.2.2,,,,,,,,,, 5.2.3, 5.2 L1, L2, L3 3-1, 2-2, 1-3,,, L1, L3, L2, ,,, ( 5.3),,, N 3 L 2 S L 1 L 3 5.1: 5.2: 1 5. 5.1,,, 5.2 5.2.1,, ( 5.1), 5.2.2,,,,,,,,,, 5.2.3, 5.2 L1, L2, L3 31, 22, 13,,, L1, L3, L2, 0 5.2.4,,, ( 5.3),,, N 3 L 2 S L 1 L 3 5.1: 5.2: 1 D C 1 0 0 A C 2 2 0 j X E 0 5.3: 5.5: f,, (),,,,, 1, 5.2.6

More information

Python Speed Learning

Python   Speed Learning Python Speed Learning 1 / 76 Python 2 1 $ python 1 >>> 1 + 2 2 3 2 / 76 print : 1 print : ( ) 3 / 76 print : 1 print 1 2 print hello 3 print 1+2 4 print 7/3 5 print abs(-5*4) 4 / 76 print : 1 print 1 2

More information

i

i 009 I 1 8 5 i 0 1 0.1..................................... 1 0.................................................. 1 0.3................................. 0.4........................................... 3

More information

No δs δs = r + δr r = δr (3) δs δs = r r = δr + u(r + δr, t) u(r, t) (4) δr = (δx, δy, δz) u i (r + δr, t) u i (r, t) = u i x j δx j (5) δs 2

No δs δs = r + δr r = δr (3) δs δs = r r = δr + u(r + δr, t) u(r, t) (4) δr = (δx, δy, δz) u i (r + δr, t) u i (r, t) = u i x j δx j (5) δs 2 No.2 1 2 2 δs δs = r + δr r = δr (3) δs δs = r r = δr + u(r + δr, t) u(r, t) (4) δr = (δx, δy, δz) u i (r + δr, t) u i (r, t) = u i δx j (5) δs 2 = δx i δx i + 2 u i δx i δx j = δs 2 + 2s ij δx i δx j

More information

05Mar2001_tune.dvi

05Mar2001_tune.dvi 2001 3 5 COD 1 1.1 u d2 u + ku =0 (1) dt2 u = a exp(pt) (2) p = ± k (3) k>0k = ω 2 exp(±iωt) (4) k

More information

コンピュータ概論

コンピュータ概論 4.1 For Check Point 1. For 2. 4.1.1 For (For) For = To Step (Next) 4.1.1 Next 4.1.1 4.1.2 1 i 10 For Next Cells(i,1) Cells(1, 1) Cells(2, 1) Cells(10, 1) 4.1.2 50 1. 2 1 10 3. 0 360 10 sin() 4.1.2 For

More information

( ) ( )

( ) ( ) 20 21 2 8 1 2 2 3 21 3 22 3 23 4 24 5 25 5 26 6 27 8 28 ( ) 9 3 10 31 10 32 ( ) 12 4 13 41 0 13 42 14 43 0 15 44 17 5 18 6 18 1 1 2 2 1 2 1 0 2 0 3 0 4 0 2 2 21 t (x(t) y(t)) 2 x(t) y(t) γ(t) (x(t) y(t))

More information

1 matplotlib matplotlib Python matplotlib numpy matplotlib Installing A 2 pyplot matplotlib 1 matplotlib.pyplot matplotlib.pyplot plt import import nu

1 matplotlib matplotlib Python matplotlib numpy matplotlib Installing A 2 pyplot matplotlib 1 matplotlib.pyplot matplotlib.pyplot plt import import nu Python Matplotlib 2016 ver.0.06 matplotlib python 2 3 (ffmpeg ) Excel matplotlib matplotlib doc PDF 2,800 python matplotlib matplotlib matplotlib Gallery Matplotlib Examples 1 matplotlib 2 2 pyplot 2 2.1

More information

画像工学特論

画像工学特論 .? (x i, y i )? (x(t), y(t))? (x(t)) (X(ω)) Wiener-Khintchine 35/97 . : x(t) = X(ω)e jωt dω () π X(ω) = x(t)e jωt dt () X(ω) S(ω) = lim (3) ω S(ω)dω X(ω) : F of x : [X] [ = ] [x t] Power spectral density

More information

N88 BASIC 0.3 C: My Documents 0.6: 0.3: (R) (G) : enterreturn : (F) BA- SIC.bas 0.8: (V) 0.9: 0.5:

N88 BASIC 0.3 C: My Documents 0.6: 0.3: (R) (G) : enterreturn : (F) BA- SIC.bas 0.8: (V) 0.9: 0.5: BASIC 20 4 10 0 N88 Basic 1 0.0 N88 Basic..................................... 1 0.1............................................... 3 1 4 2 5 3 6 4 7 5 10 6 13 7 14 0 N88 Basic 0.0 N88 Basic 0.1: N88Basic

More information

たのしいプログラミング Pythonではじめよう!

たのしいプログラミング Pythonではじめよう! Title of English-language original: Python for Kids A Playful Introduction to Programming ISBN 978-1-59327-407-8, published by No Starch Press, Inc. Copyright 2013 by Jason R. Briggs. Japanese-language

More information

m(ẍ + γẋ + ω 0 x) = ee (2.118) e iωt P(ω) = χ(ω)e = ex = e2 E(ω) m ω0 2 ω2 iωγ (2.119) Z N ϵ(ω) ϵ 0 = 1 + Ne2 m j f j ω 2 j ω2 iωγ j (2.120)

m(ẍ + γẋ + ω 0 x) = ee (2.118) e iωt P(ω) = χ(ω)e = ex = e2 E(ω) m ω0 2 ω2 iωγ (2.119) Z N ϵ(ω) ϵ 0 = 1 + Ne2 m j f j ω 2 j ω2 iωγ j (2.120) 2.6 2.6.1 mẍ + γẋ + ω 0 x) = ee 2.118) e iωt Pω) = χω)e = ex = e2 Eω) m ω0 2 ω2 iωγ 2.119) Z N ϵω) ϵ 0 = 1 + Ne2 m j f j ω 2 j ω2 iωγ j 2.120) Z ω ω j γ j f j f j f j sum j f j = Z 2.120 ω ω j, γ ϵω) ϵ

More information

( ) 2.1. C. (1) x 4 dx = 1 5 x5 + C 1 (2) x dx = x 2 dx = x 1 + C = 1 2 x + C xdx (3) = x dx = 3 x C (4) (x + 1) 3 dx = (x 3 + 3x 2 + 3x +

( ) 2.1. C. (1) x 4 dx = 1 5 x5 + C 1 (2) x dx = x 2 dx = x 1 + C = 1 2 x + C xdx (3) = x dx = 3 x C (4) (x + 1) 3 dx = (x 3 + 3x 2 + 3x + (.. C. ( d 5 5 + C ( d d + C + C d ( d + C ( ( + d ( + + + d + + + + C (5 9 + d + d tan + C cos (sin (6 sin d d log sin + C sin + (7 + + d ( + + + + d log( + + + C ( (8 d 7 6 d + 6 + C ( (9 ( d 6 + 8 d

More information

1 3 1.1.......................... 3 1............................... 3 1.3....................... 5 1.4.......................... 6 1.5........................ 7 8.1......................... 8..............................

More information

ω 0 m(ẍ + γẋ + ω0x) 2 = ee (2.118) e iωt x = e 1 m ω0 2 E(ω). (2.119) ω2 iωγ Z N P(ω) = χ(ω)e = exzn (2.120) ϵ = ϵ 0 (1 + χ) ϵ(ω) ϵ 0 = 1 +

ω 0 m(ẍ + γẋ + ω0x) 2 = ee (2.118) e iωt x = e 1 m ω0 2 E(ω). (2.119) ω2 iωγ Z N P(ω) = χ(ω)e = exzn (2.120) ϵ = ϵ 0 (1 + χ) ϵ(ω) ϵ 0 = 1 + 2.6 2.6.1 ω 0 m(ẍ + γẋ + ω0x) 2 = ee (2.118) e iωt x = e 1 m ω0 2 E(ω). (2.119) ω2 iωγ Z N P(ω) = χ(ω)e = exzn (2.120) ϵ = ϵ 0 (1 + χ) ϵ(ω) ϵ 0 = 1 + Ne2 m j f j ω 2 j ω2 iωγ j (2.121) Z ω ω j γ j f j

More information

<4D F736F F D B B BB2D834A836F815B82D082C88C602E646F63>

<4D F736F F D B B BB2D834A836F815B82D082C88C602E646F63> 信号処理の基礎 サンプルページ この本の定価 判型などは, 以下の URL からご覧いただけます. http://www.morikita.co.jp/books/mid/081051 このサンプルページの内容は, 初版 1 刷発行時のものです. i AI ii z / 2 3 4 5 6 7 7 z 8 8 iii 2013 3 iv 1 1 1.1... 1 1.2... 2 2 4 2.1...

More information

Systemwalker IT Service Management Systemwalker IT Service Management V11.0L10 IT Service Management - Centric Manager Windows

Systemwalker IT Service Management Systemwalker IT Service Management V11.0L10 IT Service Management - Centric Manager Windows Systemwalker IT Service Management Systemwalker IT Service Management V11.0L10 IT Service Management - Centric Manager Windows Systemwalker IT Service Management Systemwalker Centric Manager IT Service

More information

programmingII2019-v01

programmingII2019-v01 II 2019 2Q A 6/11 6/18 6/25 7/2 7/9 7/16 7/23 B 6/12 6/19 6/24 7/3 7/10 7/17 7/24 x = 0 dv(t) dt = g Z t2 t 1 dv(t) dt dt = Z t2 t 1 gdt g v(t 2 ) = v(t 1 ) + g(t 2 t 1 ) v v(t) x g(t 2 t 1 ) t 1 t 2

More information

(1) θ a = 5(cm) θ c = 4(cm) b = 3(cm) (2) ABC A A BC AD 10cm BC B D C 99 (1) A B 10m O AOB 37 sin 37 = cos 37 = tan 37

(1) θ a = 5(cm) θ c = 4(cm) b = 3(cm) (2) ABC A A BC AD 10cm BC B D C 99 (1) A B 10m O AOB 37 sin 37 = cos 37 = tan 37 4. 98 () θ a = 5(cm) θ c = 4(cm) b = (cm) () D 0cm 0 60 D 99 () 0m O O 7 sin 7 = 0.60 cos 7 = 0.799 tan 7 = 0.754 () xkm km R km 00 () θ cos θ = sin θ = () θ sin θ = 4 tan θ = () 0 < x < 90 tan x = 4 sin

More information

2.2 Sage I 11 factor Sage Sage exit quit 1 sage : exit 2 Exiting Sage ( CPU time 0m0.06s, Wall time 2m8.71 s). 2.2 Sage Python Sage 1. Sage.sage 2. sa

2.2 Sage I 11 factor Sage Sage exit quit 1 sage : exit 2 Exiting Sage ( CPU time 0m0.06s, Wall time 2m8.71 s). 2.2 Sage Python Sage 1. Sage.sage 2. sa I 2017 11 1 SageMath SageMath( Sage ) Sage Python Sage Python Sage Maxima Maxima Sage Sage Sage Linux, Mac, Windows *1 2 Sage Sage 4 1. ( sage CUI) 2. Sage ( sage.sage ) 3. Sage ( notebook() ) 4. Sage

More information

Gmech08.dvi

Gmech08.dvi 145 13 13.1 13.1.1 0 m mg S 13.1 F 13.1 F /m S F F 13.1 F mg S F F mg 13.1: m d2 r 2 = F + F = 0 (13.1) 146 13 F = F (13.2) S S S S S P r S P r r = r 0 + r (13.3) r 0 S S m d2 r 2 = F (13.4) (13.3) d 2

More information

Windows (L): D:\jyugyou\ D:\jyugyou\ D:\jyugyou\ (N): en2 OK 2

Windows (L): D:\jyugyou\ D:\jyugyou\ D:\jyugyou\ (N): en2 OK 2 Windows C++ Microsoft Visual Studio 2010 C++ Microsoft C++ Microsoft Visual Studio 2010 Microsoft Visual Studio 2010 C++ C C++ Microsoft Visual Studio 2010 Professional Professional 1 Professional Professional

More information

Z: Q: R: C: sin 6 5 ζ a, b

Z: Q: R: C: sin 6 5 ζ a, b Z: Q: R: C: 3 3 7 4 sin 6 5 ζ 9 6 6............................... 6............................... 6.3......................... 4 7 6 8 8 9 3 33 a, b a bc c b a a b 5 3 5 3 5 5 3 a a a a p > p p p, 3,

More information

LCR e ix LC AM m k x m x x > 0 x < 0 F x > 0 x < 0 F = k x (k > 0) k x = x(t)

LCR e ix LC AM m k x m x x > 0 x < 0 F x > 0 x < 0 F = k x (k > 0) k x = x(t) 338 7 7.3 LCR 2.4.3 e ix LC AM 7.3.1 7.3.1.1 m k x m x x > 0 x < 0 F x > 0 x < 0 F = k x k > 0 k 5.3.1.1 x = xt 7.3 339 m 2 x t 2 = k x 2 x t 2 = ω 2 0 x ω0 = k m ω 0 1.4.4.3 2 +α 14.9.3.1 5.3.2.1 2 x

More information

構造と連続体の力学基礎

構造と連続体の力学基礎 II 37 Wabash Avenue Bridge, Illinois 州 Winnipeg にある歩道橋 Esplanade Riel 橋6 6 斜張橋である必要は多分無いと思われる すぐ横に道路用桁橋有り しかも塔基部のレストランは 8 年には営業していなかった 9 9. 9.. () 97 [3] [5] k 9. m w(t) f (t) = f (t) + mg k w(t) Newton

More information

Ruby Ruby ruby Ruby G: Ruby>ruby Ks sample1.rb G: Ruby> irb (interactive Ruby) G: Ruby>irb -Ks irb(main):001:0> print( ) 44=>

Ruby Ruby ruby Ruby G: Ruby>ruby Ks sample1.rb G: Ruby> irb (interactive Ruby) G: Ruby>irb -Ks irb(main):001:0> print( ) 44=> Ruby Ruby 200779 ruby Ruby G: Ruby>ruby Ks sample1.rb G: Ruby> irb (interactive Ruby) G: Ruby>irb -Ks irb(main):001:0> print( 2+3+4+5+6+7+8+9 ) 44 irb(main):002:0> irb irb(main):001:0> 1+2+3+4 => 10 irb(main):002:0>

More information

1 9 v.0.1 c (2016/10/07) Minoru Suzuki T µ 1 (7.108) f(e ) = 1 e β(e µ) 1 E 1 f(e ) (Bose-Einstein distribution function) *1 (8.1) (9.1)

1 9 v.0.1 c (2016/10/07) Minoru Suzuki T µ 1 (7.108) f(e ) = 1 e β(e µ) 1 E 1 f(e ) (Bose-Einstein distribution function) *1 (8.1) (9.1) 1 9 v..1 c (216/1/7) Minoru Suzuki 1 1 9.1 9.1.1 T µ 1 (7.18) f(e ) = 1 e β(e µ) 1 E 1 f(e ) (Bose-Einstein distribution function) *1 (8.1) (9.1) E E µ = E f(e ) E µ (9.1) µ (9.2) µ 1 e β(e µ) 1 f(e )

More information

IA hara@math.kyushu-u.ac.jp Last updated: January,......................................................................................................................................................................................

More information

Kroneher Levi-Civita 1 i = j δ i j = i j 1 if i jk is an even permutation of 1,2,3. ε i jk = 1 if i jk is an odd permutation of 1,2,3. otherwise. 3 4

Kroneher Levi-Civita 1 i = j δ i j = i j 1 if i jk is an even permutation of 1,2,3. ε i jk = 1 if i jk is an odd permutation of 1,2,3. otherwise. 3 4 [2642 ] Yuji Chinone 1 1-1 ρ t + j = 1 1-1 V S ds ds Eq.1 ρ t + j dv = ρ t dv = t V V V ρdv = Q t Q V jdv = j ds V ds V I Q t + j ds = ; S S [ Q t ] + I = Eq.1 2 2 Kroneher Levi-Civita 1 i = j δ i j =

More information

(3) (2),,. ( 20) ( s200103) 0.7 x C,, x 2 + y 2 + ax = 0 a.. D,. D, y C, C (x, y) (y 0) C m. (2) D y = y(x) (x ± y 0), (x, y) D, m, m = 1., D. (x 2 y

(3) (2),,. ( 20) ( s200103) 0.7 x C,, x 2 + y 2 + ax = 0 a.. D,. D, y C, C (x, y) (y 0) C m. (2) D y = y(x) (x ± y 0), (x, y) D, m, m = 1., D. (x 2 y [ ] 7 0.1 2 2 + y = t sin t IC ( 9) ( s090101) 0.2 y = d2 y 2, y = x 3 y + y 2 = 0 (2) y + 2y 3y = e 2x 0.3 1 ( y ) = f x C u = y x ( 15) ( s150102) [ ] y/x du x = Cexp f(u) u (2) x y = xey/x ( 16) ( s160101)

More information

SICE東北支部研究集会資料(2012年)

SICE東北支部研究集会資料(2012年) 77 (..3) 77- A study on disturbance compensation control of a wheeled inverted pendulum robot during arm manipulation using Extended State Observer Luis Canete Takuma Sato, Kenta Nagano,Luis Canete,Takayuki

More information

F = 0 F α, β F = t 2 + at + b (t α)(t β) = t 2 (α + β)t + αβ G : α + β = a, αβ = b F = 0 F (t) = 0 t α, β G t F = 0 α, β G. α β a b α β α β a b (α β)

F = 0 F α, β F = t 2 + at + b (t α)(t β) = t 2 (α + β)t + αβ G : α + β = a, αβ = b F = 0 F (t) = 0 t α, β G t F = 0 α, β G. α β a b α β α β a b (α β) 19 7 12 1 t F := t 2 + at + b D := a 2 4b F = 0 a, b 1.1 F = 0 α, β α β a, b /stlasadisc.tex, cusp.tex, toileta.eps, toiletb.eps, fromatob.tex 1 F = 0 F α, β F = t 2 + at + b (t α)(t β) = t 2 (α + β)t

More information

1 1 sin cos P (primary) S (secondly) 2 P S A sin(ω2πt + α) A ω 1 ω α V T m T m 1 100Hz m 2 36km 500Hz. 36km 1

1 1 sin cos P (primary) S (secondly) 2 P S A sin(ω2πt + α) A ω 1 ω α V T m T m 1 100Hz m 2 36km 500Hz. 36km 1 sin cos P (primary) S (secondly) 2 P S A sin(ω2πt + α) A ω ω α 3 3 2 2V 3 33+.6T m T 5 34m Hz. 34 3.4m 2 36km 5Hz. 36km m 34 m 5 34 + m 5 33 5 =.66m 34m 34 x =.66 55Hz, 35 5 =.7 485.7Hz 2 V 5Hz.5V.5V V

More information

AMT機能セットアップガイド

AMT機能セットアップガイド Intel AMT 機能セットアップガイド C79860000 AMT ME BIOS 目次 AMT 機能とは...2 AMT 機能を使うための準備...2 AMT Local Manageability Service のインストール...3 ME BIOS の操作...4 ME BIOS の設定項目...6 ME BIOS の初期化...8 AMT 機能とは AMT 機能でできること AMT AMT

More information

) a + b = i + 6 b c = 6i j ) a = 0 b = c = 0 ) â = i + j 0 ˆb = 4) a b = b c = j + ) cos α = cos β = 6) a ˆb = b ĉ = 0 7) a b = 6i j b c = i + 6j + 8)

) a + b = i + 6 b c = 6i j ) a = 0 b = c = 0 ) â = i + j 0 ˆb = 4) a b = b c = j + ) cos α = cos β = 6) a ˆb = b ĉ = 0 7) a b = 6i j b c = i + 6j + 8) 4 4 ) a + b = i + 6 b c = 6i j ) a = 0 b = c = 0 ) â = i + j 0 ˆb = 4) a b = b c = j + ) cos α = cos β = 6) a ˆb = b ĉ = 0 7) a b = 6i j b c = i + 6j + 8) a b a b = 6i j 4 b c b c 9) a b = 4 a b) c = 7

More information

II ( ) (7/31) II ( [ (3.4)] Navier Stokes [ (6/29)] Navier Stokes 3 [ (6/19)] Re

II ( ) (7/31) II (  [ (3.4)] Navier Stokes [ (6/29)] Navier Stokes 3 [ (6/19)] Re II 29 7 29-7-27 ( ) (7/31) II (http://www.damp.tottori-u.ac.jp/~ooshida/edu/fluid/) [ (3.4)] Navier Stokes [ (6/29)] Navier Stokes 3 [ (6/19)] Reynolds [ (4.6), (45.8)] [ p.186] Navier Stokes I Euler Navier

More information

ワイヤレス~イーサネットレシーバー UWTC-REC3

ワイヤレス~イーサネットレシーバー UWTC-REC3 www.jp.omega.com : esales@jp.omega.com www.omegamanual.info UWTC-REC3 www.jp.omega.com/worldwide UWIR UWTC-NB9 / UWRH UWRTD UWTC 61.6 [2.42] REF 11.7 [0.46] 38.1 [1.50] 66.0 [2.60] REF 33.0 [1.30]

More information

listings-ext

listings-ext (10) (2) ( ) ohsaki@kwansei.ac.jp 8 (2) 1 8.1.............................. 1 8.2 mobility.fixed.......................... 2 8.3 mobility.randomwalk...................... 7 8.4 mobility.randomwaypoint...................

More information

( 9 1 ) 1 2 1.1................................... 2 1.2................................................. 3 1.3............................................... 4 1.4...........................................

More information

keisoku01.dvi

keisoku01.dvi 2.,, Mon, 2006, 401, SAGA, JAPAN Dept. of Mechanical Engineering, Saga Univ., JAPAN 4 Mon, 2006, 401, SAGA, JAPAN Dept. of Mechanical Engineering, Saga Univ., JAPAN 5 Mon, 2006, 401, SAGA, JAPAN Dept.

More information

201711grade1ouyou.pdf

201711grade1ouyou.pdf 2017 11 26 1 2 52 3 12 13 22 23 32 33 42 3 5 3 4 90 5 6 A 1 2 Web Web 3 4 1 2... 5 6 7 7 44 8 9 1 2 3 1 p p >2 2 A 1 2 0.6 0.4 0.52... (a) 0.6 0.4...... B 1 2 0.8-0.2 0.52..... (b) 0.6 0.52.... 1 A B 2

More information

128 3 II S 1, S 2 Φ 1, Φ 2 Φ 1 = { B( r) n( r)}ds S 1 Φ 2 = { B( r) n( r)}ds (3.3) S 2 S S 1 +S 2 { B( r) n( r)}ds = 0 (3.4) S 1, S 2 { B( r) n( r)}ds

128 3 II S 1, S 2 Φ 1, Φ 2 Φ 1 = { B( r) n( r)}ds S 1 Φ 2 = { B( r) n( r)}ds (3.3) S 2 S S 1 +S 2 { B( r) n( r)}ds = 0 (3.4) S 1, S 2 { B( r) n( r)}ds 127 3 II 3.1 3.1.1 Φ(t) ϕ em = dφ dt (3.1) B( r) Φ = { B( r) n( r)}ds (3.2) S S n( r) Φ 128 3 II S 1, S 2 Φ 1, Φ 2 Φ 1 = { B( r) n( r)}ds S 1 Φ 2 = { B( r) n( r)}ds (3.3) S 2 S S 1 +S 2 { B( r) n( r)}ds

More information

meiji_resume_1.PDF

meiji_resume_1.PDF β β β (q 1,q,..., q n ; p 1, p,..., p n ) H(q 1,q,..., q n ; p 1, p,..., p n ) Hψ = εψ ε k = k +1/ ε k = k(k 1) (x, y, z; p x, p y, p z ) (r; p r ), (θ; p θ ), (ϕ; p ϕ ) ε k = 1/ k p i dq i E total = E

More information

() (, y) E(, y) () E(, y) (3) q ( ) () E(, y) = k q q (, y) () E(, y) = k r r (3).3 [.7 ] f y = f y () f(, y) = y () f(, y) = tan y y ( ) () f y = f y

() (, y) E(, y) () E(, y) (3) q ( ) () E(, y) = k q q (, y) () E(, y) = k r r (3).3 [.7 ] f y = f y () f(, y) = y () f(, y) = tan y y ( ) () f y = f y 5. [. ] z = f(, y) () z = 3 4 y + y + 3y () z = y (3) z = sin( y) (4) z = cos y (5) z = 4y (6) z = tan y (7) z = log( + y ) (8) z = tan y + + y ( ) () z = 3 8y + y z y = 4 + + 6y () z = y z y = (3) z =

More information

Nosé Hoover 1.2 ( 1) (a) (b) 1:

Nosé Hoover 1.2 ( 1) (a) (b) 1: 1 watanabe@cc.u-tokyo.ac.jp 1 1.1 Nosé Hoover 1. ( 1) (a) (b) 1: T ( f(p x, p y, p z ) exp p x + p y + p ) z (1) mk B T p x p y p = = z = 1 m m m k BT () k B T = 1.3 0.04 0.03 0.0 0.01 0-5 -4-3 - -1 0

More information

最新耐震構造解析 ( 第 3 版 ) サンプルページ この本の定価 判型などは, 以下の URL からご覧いただけます. このサンプルページの内容は, 第 3 版 1 刷発行時のものです.

最新耐震構造解析 ( 第 3 版 ) サンプルページ この本の定価 判型などは, 以下の URL からご覧いただけます.   このサンプルページの内容は, 第 3 版 1 刷発行時のものです. 最新耐震構造解析 ( 第 3 版 ) サンプルページ この本の定価 判型などは, 以下の URL からご覧いただけます. http://www.morikita.co.jp/books/mid/052093 このサンプルページの内容は, 第 3 版 1 刷発行時のものです. i 3 10 3 2000 2007 26 8 2 SI SI 20 1996 2000 SI 15 3 ii 1 56 6

More information

Jacques Garrigue

Jacques Garrigue Jacques Garrigue Garrigue 1 Garrigue 2 $ print_lines () > for i in $1; do > echo $i > done $ print_lines "a b c" a b c Garrigue 3 Emacs Lisp (defun print-lines (lines) (dolist (str lines) (insert str)

More information

syspro-0405.ppt

syspro-0405.ppt 3 4, 5 1 UNIX csh 2.1 bash X Window 2 grep l POSIX * more POSIX 3 UNIX. 4 first.sh #!bin/sh #first.sh #This file looks through all the files in the current #directory for the string yamada, and then prints

More information

Part () () Γ Part ,

Part () () Γ Part , Contents a 6 6 6 6 6 6 6 7 7. 8.. 8.. 8.3. 8 Part. 9. 9.. 9.. 3. 3.. 3.. 3 4. 5 4.. 5 4.. 9 4.3. 3 Part. 6 5. () 6 5.. () 7 5.. 9 5.3. Γ 3 6. 3 6.. 3 6.. 3 6.3. 33 Part 3. 34 7. 34 7.. 34 7.. 34 8. 35

More information

AC Modeling and Control of AC Motors Seiji Kondo, Member 1. q q (1) PM (a) N d q Dept. of E&E, Nagaoka Unive

AC Modeling and Control of AC Motors Seiji Kondo, Member 1. q q (1) PM (a) N d q Dept. of E&E, Nagaoka Unive AC Moeling an Control of AC Motors Seiji Kono, Member 1. (1) PM 33 54 64. 1 11 1(a) N 94 188 163 1 Dept. of E&E, Nagaoka University of Technology 163 1, Kamitomioka-cho, Nagaoka, Niigata 94 188 (a) 巻数

More information

Visual Python, Numpy, Matplotlib

Visual Python, Numpy, Matplotlib Visual Python, Numpy, Matplotlib 1 / 38 Contents 1 2 Visual Python 3 Numpy Scipy 4 Scipy 5 Matplotlib 2 / 38 Contents 1 2 Visual Python 3 Numpy Scipy 4 Scipy 5 Matplotlib 3 / 38 3 Visual Python: 3D Numpy,

More information

自由集会時系列part2web.key

自由集会時系列part2web.key spurious correlation spurious regression xt=xt-1+n(0,σ^2) yt=yt-1+n(0,σ^2) n=20 type1error(5%)=0.4703 no trend 0 1000 2000 3000 4000 p for r xt=xt-1+n(0,σ^2) random walk random walk variable -5 0 5 variable

More information

ver.1 / c /(13)

ver.1 / c /(13) 1 -- 11 1 c 2010 1/(13) 1 -- 11 -- 1 1--1 1--1--1 2009 3 t R x R n 1 ẋ = f(t, x) f = ( f 1,, f n ) f x(t) = ϕ(x 0, t) x(0) = x 0 n f f t 1--1--2 2009 3 q = (q 1,..., q m ), p = (p 1,..., p m ) x = (q,

More information

haskell.gby

haskell.gby Haskell 1 2 3 Haskell ( ) 4 Haskell Lisper 5 Haskell = Haskell 6 Haskell Haskell... 7 qsort [8,2,5,1] [1,2,5,8] "Hello, " ++ "world!" "Hello, world!" 1 + 2 div 8 2 (+) 1 2 8 div 2 3 4 map even [1,2,3,4]

More information

JMP V4 による生存時間分析

JMP V4 による生存時間分析 V4 1 SAS 2000.11.18 4 ( ) (Survival Time) 1 (Event) Start of Study Start of Observation Died Died Died Lost End Time Censor Died Died Censor Died Time Start of Study End Start of Observation Censor

More information