49 results on '"Klančar, Gregor"'
Search Results
2. Lokalizacija mobilnega robota z uporabo različnih senzorjev
- Author
-
Klančar, Gregor, Škrjanc, Igor, and Teslić, Luka
- Published
- 2009
3. Plezajoči robotski pajek
- Author
-
Sajko, Gal and Klančar, Gregor
- Subjects
climbing robot ,plezajoči robot ,kinematics ,dinamika ,vodenje ,dynamics ,control system ,multipod ,kinematika - Abstract
V sledeči magistrski nalogi smo predstavili postopek razvoja in izdelave ple- zajočega robota, ki ima konfiguracijo multipoda s petimi nogami. Naloga ro- bota je, da med plezanjem po zidu z vodo oskrbuje rastline. Osredotočili smo se predvsem na tiste elemente, ki so bolj zanimivi iz vidika robotike in vodenja sistemov. V času razvoja smo najprej razvili kinematični in dinamični model ro- bota in njegovih nog in algoritme za načrtovanja posameznih gibov in celotnega premika robota. Nato smo zasnovali regulator, ki je sposoben vodenja vseh pe- tih nog naenkrat, a neodvisno druga od druge in lahko deluje v treh različnih načinih: pozicijskemu, hitrostnemu in v načinu vodenja po sili. Na koncu smo vse elemente povezali v aplikacijo, ki smo jo implementirali v programskem jeziku Python. The present Master thesis introduces the design and production of a climbing robot with configuration of a five-legged multipod. This robot has been developed for watering plants while climbing the wall where plants were placed. Our focus has been mainly dedicated to those parts of the project, which in our belief are of significant importance in the fields of robotics and control theory. We have developed kinematics and dynamics models of the robot and its legs, algorithms for planning individual movements and movement of the robot in general, and a regulator for control of independent movements of all five of the robot’s legs simultaneously. The regulator enables manipulation over the robot’s motion in three different modes: via position control, via velocity control, and via force control. Last but not least, we have developed an application for controlling the robot’s motion based on aforementioned approaches, written in computer programming language Python.
- Published
- 2023
4. Uporaba razvojnega okolja DeltaV pri zasnovi farmacevtskega proizvodnega obrata
- Author
-
Hostnik, Jan and Klančar, Gregor
- Subjects
pharmacy ,življenjski cikel ,DeltaV ,fizični model ,life cycle ,physical model ,sistem ,farmacija ,faza ,system ,phase ,S88 ,DCS - Abstract
Magistrsko delo se osredotoča na predstavitev potrebnih teoretičnih znanj za uspešno implementacijo računalniških sistemov v farmaciji. Ključni del je razumevanje programskega okolja DeltaV, ki predstavlja enega izmed najpogosteje uporabljenih procesnih računalniških sistemov v industriji (ang. Distributed control system, s kratico DCS). V prvi del magistrskega dela je vključena teorija. Začnemo s kratko predstavitvijo teorije sistemov DCS, nato sledi opis ključnih zadev standarda ISA S88.01, ki definira terminologijo in module šaržnih sistemov. Zadnji del pa predstavlja dobre avtomatizirane proizvodne prakse (GAMP), ki so ključne pri življenjskem ciklu vsakega računalniškega sistema v farmaciji. Drugi del predstavlja predstavitev programskega okolje DeltaV. V njem predstavimo šest ključnih programov v tem programskem okolju, ki so ključni za uspešno implementacijo in nato validacijo vsakega računalniškega sistema. Zadnji del magistrske naloge pa predstavlja končno implementacijo celotnega farmacevtskega proizvodnega obrata. V tem delu predstavimo ključne module vodenja in faze, ki smo jih implementirali. Na koncu pa še predstavimo uporabniški vmesnik in končni recepturi. The master thesis focuses on presenting the necessary theoretical knowledge for the successful implementation of computer systems in pharmacy. The key part is understanding the DeltaV software environment, which is one of the most commonly used distributed control systems (DCS) in the industry. The first part of the master thesis includes theory. We begin with a brief introduction to DCS systems theory, followed by a description of key aspects of the ISA S88.01 standard, which defines the terminology and modules of batch systems. The final part presents good automated manufacturing practices (GAMP), which are crucial for the life cycle of any computer system in pharmacy. The seconds part presents the DeltaV software environment. We present six key programs in the software environment that are essential for successful implementation and subsequent validation of each computer system. The last part of the master thesis presents the final implementation of the entire pharmaceutical production plant. In this part, we present the key control modules and phases that we have implemented. Finally, we present the user interface and final recipes.
- Published
- 2023
5. Načrtovanje poti vozil z različnimi prioritetami na osnovi algoritma SIPP
- Author
-
Ljubi, Matic and Klančar, Gregor
- Subjects
čakanje ,planiranje poti ,algorithm SIPP ,route planning ,avtonomna vodena vozila ,Automatic guided vehicles ,safe and busy intervals ,algoritem SIPP ,varni in zasedeni intervali ,waiting - Abstract
Z razvojom avtomatizirane proizvodnje so v transportu avtonomna vozila pridobila pomembno vlogo v logistični industriji. Za učinkovito delovanje robotskih vozil je potrebno dobro načrtovati poti, da zagotovimo njihovo optimalno delovanje in s tem posledično preprečimo morebitne konflikte. V delu predlagamo pristop planiranja poti, ki temelji na algoritmu SIPP. Algoritem SIPP je hitra oblika algoritma A* za načrtovanje v dinamičnih okoljih, s konceptom varnega intervala in najzgodnejših časov prihoda v vozlišče. Algoritem pri načrtovanju poti upošteva prioriteto vozil. Algoritem na začetku določi pot vozilu z najvišjo prioriteto, nato sledijo ostala vozila. Vsa nižje prioritetna vozila morajo pri svojem načrtovanju upoštevati časovne zasedenosti vozlišč in cest prehodnih vozil. V primeru, da algoritem vozilu določi čakanje, ta čakajo v vozlišču. V posodobljenem algoritmu vozila namesto čakanja v vozlišču čakajo na cesti pred vozliščem. Vozila s čakanjem na cesti omogočijo prost prehod ostalim vozilom mimo vozlišča in tako lahko hitreje dosežejo svoj cilj. V primeru, da na trenutni cesti ni dovolj prostora, da bi vsa vozila imela zagotovljeno varno čakanje, potem posodobljeni algoritem predlaga čakanje na predhodni cesti. Pristop planiranja poti vozil je prikazan na simulacijskih primerih. Automated guided vehicles have gained an important role in the logistic industry with the development of automated production. For the efficient operation of robotics vehicles, it is necessary to plan routes well in order to ensure their optimal operation and thereby prevent potential conflicts. Is this work, we propose a route planning approach based on the SIPP algorithm. The SIPP algorithm is a fast form of the A* algorithm for scheduling in dynamic environments, with the concept of safe interval and earliest arrival times at a node. The algorithm takes into account the priority of vehicles when planning the route. The algorithm initially determines the path of the vehicle with the highest priority, then other vehicles follow. All lower priority vehicles must take into account the time occupation of node and roads of transit vehicles in their planning. If the algorithm assigns a waiting time to the vehicle, it waits in the node. In the updated algorithm, instead of waiting in the node, vehicles wait on the road in front of the node. By waiting on the road, vehicles allow free passage for other vehicles past the node and thus can reach their destination faster. In the event that there is not enough space on the current road for all vehicles to have a guaranteed safe waiting, then the updated algorithm suggests waiting on the previous road. The vehicle path planning approach is shown on simulation examples.
- Published
- 2023
6. Simulator mobilnega robota v skladiščnem okolju, zasnovan v okoljih Unity in Matlab
- Author
-
DOLINAR, ALJAŽ and Klančar, Gregor
- Subjects
mobilni robot ,pathfinding ,Unity ,Simulink ,iskanje poti ,vodenje ,simulation ,simulacija ,mobile robot ,PID-regulator ,UDP ,PID control ,control ,Matlab - Abstract
V okviru magistrskega dela smo ustvarili orodje za simulacijo kolesnih mobilnih robotov v skladiščnih okoljih. Orodje sestavljata dva ključna gradnika: simulator mobilnega robota in sistem vodenja. Simulacija je realizirana v razvojnem okolju Unity, vodenje pa v okolju Matlab-Simulink. Med seboj komunicirata preko internetnega komunikacijskega protokola UDP. Simulacija je namenjena predvsem, da služi kot učni pripomoček študentom robotike. Dodatno smo implementirali še nekaj pogostih algoritmov vodenja, ki služijo kot primeri uporabe razvite rešitve. V uvodnih dveh poglavjih magistrske naloge je predstavljena tematika kolesnih mobilnih robotov: njihova umestitev v robotiki in industriji, njihova tipična okolica in senzorika. Poudarek je na razumevanju elementov mobilnih robotov, ki bodo relevantni v kasnejših poglavjih kot del simulacije. V naslednjem poglavju je predstavljena simulacija, ki smo jo ustvarili v okviru tega dela. Za pomoč pri razumevanju so na kratko predstavljene glavne uporabljene komponente in pomembni pojmi okolja Unity. Razloženi so vsi ključni elementi programa: kontrolnik kamere, kontrolnik grajenja, sistem shranjevanja in nalaganja, simulacija samega robota in implementacija UDP komunikacije z okoljem Matlab-Simulink. Predstavljene so tudi implementacije simuliranih senzorjev: svetlobni merilnik razdalje Lidar, senzor za sledenje črti in senzor za zaznavo NFC značk. V nadaljevanju je predstavljenih nekaj pogostih rešitev iskanja optimalne poti za mobilne robote: algoritem Dijkstra, algoritem A* ter iskanje v širino in iskanje v globino. Podrobno je predstavljena tudi izvedba algoritma A*, ki je bila v okviru tega magistrskega dela implementirana v okolju Matlab. V sklepnem delu je predstavljenih še nekaj najpogostejših algoritmov vodenja, ki smo jih kot primer uporabe za končnega uporabnika simulacije razvili v okolju Matlab-Simulink. Gre za algoritme vodenja v točko, vodenja po črti in izogibanja trkov. Within the scope of this thesis, we created a tool for simulating wheeled mobile robots in warehouse-like enviroments. It contains two key elements: a mobile robot simulator and its control system. The simulation was created in Unity development platform and the control system was made in Matlab-Simulink environment. The two elements communicate via the UDP internet communcication protocol. The simulation is intended to serve as a learning assist to robotics students. Additionally, we implemented a few common control algorithms, which serve as usage examples of the developed solution. In the opening two chapters of the thesis, the topic of wheeled mobile robotics is presented: its place in robotics and industrial applications, their typical environment and sensorics. An emphasis is placed on understanding those elements of mobile robots, that will be relevant in the upcoming chapters as parts of the simulation. Next chapter presents the simulation, that was created in the scope of this thesis. The most important used components and concepts of Unity environment are briefly explained to aid the reader's understanding. Key elements of the program are explained: a camera controller, a building controller, a save and load system, the robot simulation itself and the implementation of communication between the two used environments via UDP. Additionally, implementations of simulated sensors are also presented: Light ranging and detection sensor (Lidar), Line following sensor and NFC tag reader. Afterwards, a few common optimal path finding solutions are presented: Dijkstra's Algorithm, Algorithm A*, Breadth-first Search and Depth-first Search. The chapter also contains a detailed explanation of the implemented A* algorithm. A few of the most common control algorithms are presented in the closing chapter. We developed the following control algorithms in the Matlab-Simulink environment: control to point, line following control and obstacle avoidance. These serve as usage examples for the end user of the developed simulation.
- Published
- 2023
7. Navigacija avtonomnega robota v simuliranem koruznem polju
- Author
-
BOBEK, URBAN and Klančar, Gregor
- Subjects
precizno kmetijstvo ,kolesni robot ,precision farming ,SLAM ,wheeled robot ,simulation ,simulacija ,autonomous navigation ,avtonomna navigacija - Abstract
Večanje človeške populacije in z njo potrebe po hrani predstavlja izziv za svetovno kmetijstvo. K večji proizvodnji pridelkov lahko veliko prispeva kmetijska robotika, ki bi v prihodnosti povečala donos, trajnost in dostop do pridelkov ter hkrati zmanjšala uporabo pesticidov. V tej nalogi smo se osredotočili na enega od mnogih izzivov preciznega kmetijstva in sicer na avtonomno navigacijo po kmetijski površini. Razvili smo navigacijski algoritem, ki je sposoben uspešno navigirati majhnega mobilnega robota po simuliranem polju koruze. Za načrtovanje poti, ki robota vodi po sredini vrst in iz ene vrste v drugo, smo uporabili meritve iz 2D LiDAR senzorja. Te podatke smo obdelali s postopkom rojenja DBSCAN in SLAM algoritmom. Robustnost navigacijskega algoritma smo preverili na poljih z različno razgibanostjo tal in gostoto posejanih rastlin. Pokazali smo, da kljub temu, da večja razgibanost tal vpliva na kvaliteto vodenja in delovanja SLAM algoritma, ima na kvaliteto navigacije bistveno večji vpliv gostota posejanosti rastlin. Naš algoritem je torej sposoben navigirati majhnega mobilnega robota po simuliranem polju koruze z razgibanim terenom, dokler je to dovolj gosto posejano. The increasing number of human population and its growing need for food presents a great challenge for global farming. In the future, agricultural robotics can greatly contribute to increased production of crops, which would increase yield, sustainability and access to crops and at the same time reduce the use of pesticides. In this work we focus on one of the many challenges of precision farming, namely autonomous navigation in an agricultural environment. We developed a navigation algorithm that is capable of successfully navigating a small agricultural robot in a simulated maize field. We used measurements from a 2D LiDAR sensor to plan a path that guides the robot through the field rows and from one row to another. These measurements were processed using the clustering algorithm DBSCAN and a SLAM algorithm. The robustness of the navigation algorithm was tested on simulated fields with different levels of terrain roughness and plant density. In our tests we show that higher levels of terrain roughness affect the quality of the robot driving and SLAM algorithm, however lowering the plant density has the largest effect on the quality of the navigation. We conclude that our algorithm is capable of navigating a small mobile robot in a simulated maize field as long as the field is sufficiently densely planted.
- Published
- 2022
8. Večagentno planiranje poti z algoritmom CBS
- Author
-
LOVŠIN, JAN and Klančar, Gregor
- Subjects
CBS algorithm ,CCBS algorithm ,iskanje trkov ,CCBS algoritem ,CBS algoritem ,optimal paths ,optimalne poti ,multi-agent algorithm ,ICBS algoritem ,večagentni algoritem ,collision search ,ICBS algorithm - Abstract
Iskanje poti za skupino agentov in koordinirano gibanje v skupnem okolju je osnovni problem večagentnih sistemov. Algoritme za večagentno planiranje poti lahko delimo v optimalne in podoptimalne. Iskanje optimalnih rešitev je zahtevno, saj prostor stanj raste eksponentno s številom agentov in zato problem ni rešljiv v polinomskem času. V primeru večjega števila agentov se uporabljajo podoptimalni algoritmi, ki hitro najdejo izvedljive rešitve. CBS (angl. Conflict-Based Search) algoritem je večagentni algoritem, ki deluje na osnovi iskanja trkov med agenti in deluje na dveh nivojih. Nižji nivo je namenjen iskanju optimalne poti posameznega agenta. Višji nivo pa preverja konflikte med agenti, gradi drevo konfliktov z detekcijo trkov med agenti in išče najboljšo rešitev brez trkov. Zaradi delovanja na dveh nivojih je veliko hitrejši od algoritma $A^{*}$, saj algoritem CBS ne upošteva opcij, kjer ne more priti do optimalne poti. Slabost algoritma se pokaže, ko imamo prostor, kjer je med računanjem do neke točke optimalnih poti več. Takrat mora algoritem preveriti vse poti in preveriti, če je katera izmed njih boljša. Namen diplomske naloge je pregled in spoznavanje delovanja algoritma CBS in njegovih nadgradenj, prav tako pa primerjati algoritem CBS z nekaterimi ostalimi algoritmi ter primerjanje algoritma CBS z njegovimi izboljšavami. Finding a path for a group of agents and coordinated movement in a common environment is a fundamental problem of multi-agent systems. Algorithms for multi-agent route planning can be divided into optimal and suboptimal. Finding optimal solutions is challenging as the state space grows exponentially with the number of agents and therefore the problem cannot be solved in polynomial time. Therefore, in the case of a larger number of agents suboptimal algorithms are used which quickly find viable solutions. The CBS (Conflict-Based Search) algorithm is a multi-agent algorithm that works on the basis of searching for conflicts between agents and works on two levels. The low level search is dedicated to find the optimal path of a single agent at a time. At the high level, search is performed on a tree based algorithm with a help of conflicts between agents. Because it is a two-level algorithm, it is much faster than the $A^{*}$ algorithm since the CBS algorithm examines fewer states while still maintaining optimality. A weakness of the algorithm occurs when we have an open space. There are a few optimal paths during this calculation. In this case, the algorithm must examine all of them to see if there is a better one. The purpose of the diploma thesis is to review and learn about the operation of the CBS algorithm and its improvements, as well as to compare the CBS algorithm with some of the other algorithms and to compare the CBS algorithm with its improvements.
- Published
- 2022
9. Vodenje redundantnega neholonomičnega mobilnega manipulatorja
- Author
-
Baumgartner, Jakob and Klančar, Gregor
- Subjects
direct kinematics ,manipulabilnost ,inverse kinematics ,robotski manipulator ,redundantni robot ,robotic manipulator ,inverzna kinematika ,differential drive ,direktna kinematika ,kinematics ,neholonomične omejitve ,manipulability ,nonholonomic constraints ,optimizacija ,diferencialni pogon ,optimization ,redundant robot - Abstract
V številnih panogah si industrije brez podpore robotizacije v obliki manipulatorjev ne moremo več predstavljati. Manipulatorji so večinoma fiksno vpeti, saj lahko z delovnim dosegom učinkovito opravijo zahtevana opravila. V primeru zahtev po večjem dosegu pa je potrebno uporabiti mobilne manipulatorje, kjer je manipulator pritrjen na mobilno platformo. Slednje zahteva naprednejše algoritme za lokalizacijo in vodenje. V magistrskem delu smo rešili problem vodenja redundantnega neholonomičnega mobilnega manipulatorja. Uporabljali smo robotski sistem sestavljen iz mobilne platforme Pal Tiago Base, na kateri je bil nameščen robotski manipulator Panda Emika Franka. Za robotski sistem smo izdelali dva različna modela kinematike. Pri prvem modelu smo za vodenje sklepov mobilne platforme uporabili enačbe kinematike diferencialnega pogona. Pri drugem modelu pa smo mobilno platformo modelirali kot kombinacijo navideznega rotacijskega in navideznega translacijskega sklepa. Izdelali in preizkusili smo različne optimizacije za reševanje problema redundantnosti sestavljenega robotskega sistema. Za odpravo problema neholonomičnih omejitev pogona smo s pomočjo optimizacije kota med platformo in točko, mobilno platformo med vodenjem orientirali proti ciljni točki. Izdelali smo algoritem vodenja, ki smo ga preizkusili v simulacijskem in realnem okolju. Pri vodenju robota v realnem okolju smo meritve lege platforme in manipulatorja zajemali s pomočjo sistema OptiTrack. Za preizkus smo si zamislili dve različni poti točk, po katerih smo (v simulaciji) vodili našega robota. Ugotovili smo, da optimizacija manipulabilnosti vrha robota izboljša sledenje trajektoriji, vendar pa robot zahaja v limitne lege sklepnih vrednosti, ter posledično ne more nadaljevati svoje naloge. Z uporabo optimizacije za doseg želene lege sklepov smo rešili problem zahajanja sklepov v končne lege, poslabšali pa smo kakovost sledenja trajektoriji. In many industries, it is no longer possible to imagine factories without the support of robotization in the form of robotic manipulators. The manipulators are mostly fixed, as they can efficiently perform the required tasks within their working reach. In the case of requirements for greater reach, it is necessary to use mobile manipulators, where the manipulator is attached to a mobile platform. The latter requires a more advanced localization and guidance algorithms. In the master’s thesis, we solved the problem of controlling a redundant non-holonomic mobile manipulator. We used a robotic system consisting of a Pal Tiago Base mobile platform, on which Emiko Frank's Panda robotic manipulator was installed. We created two different kinematics models for the robot system. In the first model, we used differential drive kinematics equations to guide the joints of the mobile platform. In the second model, we modelled the mobile platform as a combination of virtual rotational and virtual translational joints. We developed and tested various optimizations to solve the redundancy problem of the composite robot system. We oriented the mobile platform towards the target point while guiding the robot to solve the problem of non-holonomic limitations of the drive, by optimizing the angle between the platform and the point. We developed a guidance algorithm which we tested in a simulation and real environment. Measurements of the position of the platform and the manipulator were captured using the OptiTrack system, when guiding the robot in a real environment. For the test, we imagined two different paths of points along which we (in the simulation) guided our robot. We found that optimizing the manipulability of the top of the robot improves trajectory tracking but the robot enters the limit positions of the joint values, and as a result cannot continue its task. By using optimization to reach the desired position of the joints, we solved the problem of the joints moving into their final positions but worsened the quality of trajectory tracking.
- Published
- 2022
10. Analiza delovanja algoritma planiranja poti več vozil v skladišču
- Author
-
VERHOVŠEK, DAVID and Klančar, Gregor
- Subjects
Tkinter ,graphical user interface ,map ,grafični uporabniški vmesnik ,zemljevid ,Python - Abstract
Skladišča po svetu postajajo vse večja in potrebujejo vse več vozil in ljudi, da jih upravljajo, zato je na tem področju velika želja po tem, da se jih čim bolj avtomatizira, saj jih s tem naredimo učinkovitejše. Fakulteta za elektrotehniko v Ljubljani razvija algoritem, ki simulira in planira poti večih vozil, pri čemer skrbi, da se vozila izogibajo trkom. Za planiranje poti skrbi znani algoritem A*, ki je pa nadgrajen, da upošteva in predlaga še čakanje pred vozlišči in pa umik na stranske ceste, če je to potrebno. Vendar pa bolj kot postaja nek program kompleksen in temeljit, kompleksnejša lahko postaja njegova uporaba, zato so za učinkovito uporabo nujno potrebne poenostavitve. Slabost tega programa za načrtovanje poti pa je, da je sama implementacija vsakega zemljevida zelo zamudna, saj je potrebno v kodo ročno vpisati ogromno parametrov, zaradi tega si je tak zemljevid tudi težko prestavljati in si ga je potrebno predhodno nekam načrtati. Poleg tega je pa izdelava tega zemljevida zelo specifična in se mora oseba, ki se tega loti, predhodno spoznati s pravili gradnje zemljevida. Zato sem napisal grafični vmesnik, ki to delo zelo olajša, saj lahko enostavno z miško premikamo ceste po zaslonu, jih povečujemo in obračamo s tipkami na tipkovnici ter v razna prazna polja vpisujemo parametre, ki jih potrebujemo. S tem uporabniku ni treba poznati same sestave in oblike kode, ki je potrebna za izdelavo zemljevida, saj za vse to poskrbi sam algoritem. Warehouses all around the world are becoming bigger and need more vehicles and people to manage them. Consequently we need to automate that as much as possible so the warehouses become more efficient. Faculty of electrical engineering in Ljubljana is developing an algorithm for planning the paths of multiple vehicles in a simulated warehouse. Planning the paths is taken care of by an A* algorithm, which is upgraded so it takes into account and suggests the waiting times before crossroads and retreats of the vehicles into the side roads if needed. However the more the software becomes thorough, the more complex its usage can become and to avoid that we need simplifications. The negative side of this algorithm for planning the paths is that the implementation of each map of roads for the vehicles is very time-consuming, because you need to write a lot of parameters one by one directly into the source code and because of the complexity of the maps you need to make additional sketches beforehand. Besides that, the making of this map is very specific and unintuitive so you would first need to learn how to make it. Therefore I programed a graphical user interface which makes the implementation of maps a lot easier, because you can move roads by mouse, make them larger or smaller or rotate them by pressing keys on keyboard and write in needed parameters simply by using input boxes. The user now doesn't need to know how to make the official complicated function that creates maps, because all that is done by my algorithm.
- Published
- 2022
11. Prediktivno vodenje kolesnih robotov v industrijskem okolju
- Author
-
RAVNIKAR, ROBI and Klančar, Gregor
- Subjects
planiranje poti ,generiranje trajektorij ,izogibanje oviram ,vodenje ,kolesni roboti ,lokalno planiranje ,mobilna robotika ,obstacle avoidance ,mobile robotics ,trajectory rollout ,dynamic window approach ,prediktivno vodenje ,local planning ,wheeled robots ,dinamično okno ,control ,path planning ,predictive control - Abstract
Zaradi vse večjega vključevanja ljudi v delovni prostor je narasla potreba po zanesljivem algoritmu, ki je sposoben detekcije in izogibanja ovir. V ta namen so se razvili prediktivni algoritmi vodenja, ki vnaprej predvidevajo trk z objektom in robota predhodno preusmerijo. V magistrski nalogi bom predstavil algoritem, ki rešuje problematiko vodenja mobilnih robotov v industrijskem okolju. Predstavljen algoritem se naslanja na bolj znan pristop dinamičnega okna in dinamičnega generiranja trajektorij ter skuša odpraviti njune pomanjkljivosti. Povečano je število možnih poti, med katerimi algoritem lahko izbira, ter njihova razvejanost. Dodal sem kompenzacijo časovnega zamika med zajemom lokalizacijskih podatkov ter njihovo uporabo v izračunu poti. Poleg osnovnih cen za odmik od cilja in poti sta na voljo še ceni za spremembo translatorne in kotne hitrosti, ki omogočata boljši nadzor nad dinamiko vozila. Algoritem sem testiral tako v simulacijskem okolju Gazebo kot v realnem okolju na robotu podjetja Epilog d. o. o. V simulacijskem okolju sem najprej preveril njegovo osnovno delovanje, nato pa še sposobnost izogibanja statičnim oviram. Na robotu pa sem opravil test gibanja iz točke A v B, izogibanje statični oviri ter izogibanje gibajoči se osebi. Rezultate vseh testov sem predstavil v obliki dveh grafov, ki prikazujeta razdaljo do končnega cilja ter napako sledenja globalni poti. V zaključku sem še opisal večje pomanjkljivosti algoritma ter predlagal možne izboljšave. Due to an ever increasing inclusion of people into the workspace of robots, the demand arose for a reliable algorithm that is capable of obstacle detection and avoidance. To fulfill that demand, a group of predictive control algorithms were developed that can predict collisions with objects and divert the robot in order to avoid them. The algorithm I present in this thesis is based on the more widely known dynamic window and trajectory rollout algorithms and tries to correct their flaws. The number of additional possible paths is increased and so are their branching options. I added a time delay compensation to compensate for the time difference between the capture of localization data and their usage in the algorithm. Besides the base cost parameters of distance to goal and path following error, two new were added. The costs of translational and angular velocity change, help increase the users control over the dynamics of the robot. I tested the algorithm both in the Gazebo simulation environment software and in a real environment with a mobile robot developed by the company Epilog d.o.o. The simulation was first used to test the basic functionalities of the algorithm and later its ability to avoid static obstacles. With the real robot, we performed tests that determined if it could travel from point A to B, avoid static obstacles and avoid a moving person. In the conclusion I describe all the major flaws of the algorithm and ways to improve it.
- Published
- 2021
12. Lokalizacija robota v prostoru z uporabo stereo kamere Intel RealSense T265
- Author
-
Škrlep, Klemen and Klančar, Gregor
- Subjects
senzorji ,robot ,regulation ,system ,built-in ,sensors ,regulacija ,autonomous ,Raspberry ,python ,kamera ,avtonomen ,udc:681.5:007.52(043.2) ,sistem ,T265 ,vgradni ,camera - Abstract
Diplomsko delo zajema postopek seznanjanja z vsako od treh glavnih komponent za izvedbo avtinomnega mobilnega sistema – robotom (Roomba model 600), kamero (Intel RealSense T265) in vgradnim sistemom (Raspberry Pi 3). Delo obravnava vzpostavitev povezave med navedenimi napravami in na koncu še sestavo programa, ki s pomočjo lokalizacije na osnovi slike omogoča avtonomno delovanje mobilnega sistema. Za dosego cilja je potrebno dobro razumevanje vsake posamezne naprave in programskega vmesnika, ki ga le-ta uporablja. Poseben poudarek je narejen na opisu kamere, senzorjev in obdelavi signalov. Povezava kamere z drugimi napravami potrebuje namestitev ustreznih knjižnic, medtem ko povezava med robotom in vgradnim sistemom potrebuje poseben vmesnik. Za izvedbo vodenja mobilnega sistema so uporabljene osnovne enačbe za računanje s koti in hitrostmi, ki so skupaj povezane s proporcionalnim regulatorjem. Sam cilj naloge je izvedba avtonomnega mobilnega sistema, ki lahko potuje med želenimi točkami ter se na poti uspešno umika oviram. Glede na cenovni razpon naprav, je sistem sorazmerno stabilen, pogreški pa so relativno majhni. The thesis consists of the procedure of acquaintance with each of the three main devices that comprise an autonomous mobile system - robot (Roomba model 600), camera (Intel RealSense T265) and embedded system (Raspberry Pi 3). The work presents the coupling of the presented devices and writing of program code that uses vision-based localization for autonomous driving of the mobile system. To achieve this goal, a good understanding of each device and the programming environment it uses is required. In this thesis, particular emphasis is placed on the description of the camera, sensors and signal processing. The connection of the camera with other devices requires the installation of appropriate libraries, while the connection between the robot and the embedded system requires a special interface. For the implementation of autonomous driving, I have used some basic equations for the calculation of angle and velocity, which are combined in a P-type controller. The goal of the work is to build an autonomous mobile system that is able to drive autonomously between desired points while avoiding obstacles. Considering the price range of the devices used, the system is quite stable while the errors are relatively small.
- Published
- 2021
13. Planiranja poti več robotskih vozil z upoštevanjem prioritet in časovnih oken zasedenosti segmentov zemljevida
- Author
-
PRESEČNIK, NEJC and Klančar, Gregor
- Subjects
planiranje poti ,time windows ,AGV ,autonomous driving ,avtonomna vozila ,več-robotni sistemi ,avtomatizirana skladišča ,izogibanje konfliktom ,automated warehouses ,collision avoidance ,časovna okna ,multirobot systems ,path planning - Abstract
Pri avtonomni vožnji robotskih vozil, je planiranje poti eden ključnih izzivov s katerim se soočamo. Za usklajeno delovanje skupine mobilnih robotskih vozil pri transportu materiala v sodobnih skladiščih in proizvodnih obratih, del planiranja poti predstavlja tudi izogibanje potencialnim konfliktom. V delu predlagamo nov pristop planiranja poti z algoritmom, ki temelji na znanem algoritmu A* in je nadgrajen za planiranje poti več robotskih vozil tako, da najde kompromisno rešitev brez trkov in nepotrebnih zastojev. Pristop upošteva prioritete transportnih nalogov, zemljevid v obliki uteženega usmerjenega grafa ter predvidena časovna okna zasedenosti segmentov zemljevida. Algoritem najprej poišče pot za vozila z višjimi prioritetami. Ob vsakem planiranju poti vozila, algoritem na koncu zabeleži predvidena časovna okna zasedenosti cest in vozlišč na zemljevidu za najdeno pot. Te zasedenosti se nato upoštevajo pri iskanju poti za vozilo z nižjo prioriteto tako, da ne ovira vožnje vozil z višjo prioriteto in se izogne konfliktom. Dve pomembni možnosti, ki jih algoritem upošteva in predlaga, sta čakanje pred vozliščem oz. na poti do vozlišča, da se prehod sprosti in pa možnost umika na stransko cesto v primeru onemogočenega čakanja. Algoritem upošteva tudi možnost hkratne vožnje več vozil po isti cesti ter ponovni zagon planiranja v poljubnem časovnem trenutku. Pristop je ovrednoten na simulacijskih primerih. With autonomous driving of robotic vehicles, path planning is one of the key challenges we face with. For coordinated operation of a group of automated guided vehicles (AGV) in the transport of material in modern warehouses and production facilities, part of path planning is also avoidance of potential conflicts. In this paper, we propose a new path planning approach with an algorithm which is based on the well-known algorithm A* and upgraded for path planning of multiple AGVs in such a way that it finds a solution without collisions and unnecessary congestions. The approach considers the priorities of transport orders, the map in the form of a weighted oriented graph, and the predicted time windows of the occupancy of the map segments. The algorithm first finds a path for AGVs with higher priorities. At the end of path planning for every AGV, the algorithm marks predicted time windows of occupancy of roads and nodes according to found path. These occupancies are then considered when planning a path for an AGV with a lower priority so that it does not obstruct the driving of AGVs with a higher priority and so that it avoids conflict. Two important options that the algorithm considers and suggests are waiting in front of the node or on the way to the node in order to clear the passage, and the possibility of r moving out of the way to a side road in case the waiting is disabled. The algorithm also takes into account the possibility of several vehicles driving on the same road at the same time and the option of restarting planning at any time. The approach is evaluated on simulation cases.
- Published
- 2021
14. Vodenje sistema žoga na plošči s slikovnim senzorjem in razvojno tiskanino Arduino Uno
- Author
-
Varga, Matic and Klančar, Gregor
- Subjects
Sistem žoga na plošči ,pixy ,PID-regulation ,PID-regulacija ,Ball on plate system ,Arduinom Uno ,udc:681.5(043.2) - Abstract
V diplomskem delu je opisan zagon in delovanje sistema žoga na plošči (angleško ball on plate system), ki je voden z mikrokrmilnikom Arduinom Uno in pametno kamero pixy. Namen diplomskega dela je predstavitev delovanja PID-regulatorja (proporcinalno-integrirni-diferencirni), ki se zelo pogosto pojavlja v avtomatizaciji, na učnem modelu kot je sistem žoge na plošči. Sistem žoga na plošči je sistem, ki z nagibanjem ploskve, na kateri je žogica, regulira položaj te žogice. Na začetku dela je predstavljeno teoretično ozadje delovanja PID-regulacije, sledi predstavitev uporabljene opreme in naprav. V osrednjem delu diplomske naloge so predstavljene dve različni programski kodi za izvedbo PID-regulacije z mikrokrmilnikom Arduino Uno, in sicer programska koda z že pripravljenimi funkcijami za realizacijo PID-regulacije in programska koda s funkcijo PID-regulatorja, ki sem jo napisal sam. Opisan je tudi postopek uglaševanja PID-regulatorja s pomočjo nastavitvenih pravil za integrirne sisteme. Predstavljeni so tudi odzivi sistema z regulacijo. V zaključku diplomskega dela so povzete lastnosti sistema in podane morebitne slabosti in izboljšave sistema. The diploma thesis describes the start-up and operation of the Ball on plate system with an Arduino Uno microcontroller and a smart pixy camera. The purpose of the diploma thesis is to present the operation of the PID-controller, which is often used in automation, on a learning model such as the Ball on plate system. Ball on plate system is a system that regulates the position of the ball by tipping the surface on which the ball is. At the beginning of the thesis, the theoretical background of PID-regulation is presented, followed by a presentation of all used equipment and devices. The main part of the diploma thesis presents two different program codes for the implementation of PID-regulation with Arduino Uno microcontroller, namely program code with already prepared functions for the implementation of PID-regulation and program code with PID-controller function, which I wrote myself. The process of specifying the parameters of PID-controller using the setup rules for integrated systems is also described. The responses of the system with regulation are also described. In the conclusion, the properties of the system are summarized and possible weaknesses and improvements of the system are given.
- Published
- 2021
15. Nadzor dostopa z razpoznavo obraza s pomočjo kamere ESP-32 in senzorja VL53L1X
- Author
-
Korošec, Matej and Klančar, Gregor
- Subjects
contorl system ,nadzorni sistem ,ESP32-CAM camera ,kamera ESP-32 ,VL53L1X laser distance sensor ,senzor razdalje VL53L1X ,razpoznava obraza ,udc:681.518.5:004.93(043.2) ,face recognition - Abstract
Dandanes so nadzorni sistemi vse pogosteje v uporabi. Uporabljajo se za preprečevanje materialne ali kakršne koli drugačne škode. Sistem nadzorovanja z razpoznavo obraza je idealna rešitev za marsikatero aplikacijo. Največkrat se razpoznava obraza uporablja za namene policije ali drugih organov pregona. V zadnjem času se je razpoznava obraza začela uporabljati tudi na širšem področju, pri čemer najbolj izstopata razpoznava obraza na pametnih telefonih in razpoznava obraza za dostopanje do bančnih storitev prek interneta. V diplomskem delu bo izdelana aplikacijo za nadzorni sistem s pomočjo kamere ESP32-CAM in laserskega senzorja razdalje VL53L1X. Kamera ima že vgrajeno funkcijo razpoznave obrazov. Naloga diplomskega dela je, da se kamera uporabi za razpoznavo obraza shranjenih oseb in vrne povratno informacijo o stanju (ali je oseba prepoznana pravilno ali ne). Senzor razdalje VL53L1X se uporablja kot pomoč pri nastavljanju pravilne razdalje med obrazom in kamero ESP32-CAM za najboljše rezultate razpoznave. Nowadays control systems are getting more and more popular each day. They are being used to prevent material and other types of damage. Face recognition control system is the ideal solution for many applications. Most commonly it is used for law enforcement purposes, but lately the use has expanded quite a bit. Most people come across it every day, by unlocking their phone with the face recognition feature that most of the smartphones have. It is also used for accessing banking information online. The diploma thesis describes the process of creating an application for a access control system with the help of an ESP32-CAM camera and the VL53L1X laser distance sensor. The camera already has a face recognition feature installed and my task is to use that feature for face recognition of the people, whoses faces I had to save onto the camera software, and camera can then return the feedback information about the status (meaning whether the person has been recognized correctly or not). The distance sensor VL53L1X is used just as a tool to help adjust the correct distance between the face and the ESP32-CAM camera for optimal results.
- Published
- 2021
16. Testiranje modulov transportnega sistema pomivalnih strojev medicinskih pripomočkov - WA290
- Author
-
Štrubelj, Nejc and Klančar, Gregor
- Subjects
test device ,testna naprava ,electrical scheme ,EPLAN Electric P8 ,udc:621.3:681.5(043.2) ,instructions ,navodila ,električna shema - Abstract
Diplomska naloga opisuje postopek zasnove in izvedbe testne naprave za testiranje transportnih sistemov WA290 za pomivalno dezinfekcijske medicinske stroje, ki so produkt podjetja Belimed. Testno napravo sestavljata glavna elektro omara A02 in elektro omara A01, ki simulira stroj WD290/WD290 IQ in avtonomni transportni modul. Testna naprava je namenjena testiranju posameznih modulov avtomatiziranega sistema. Testna naprava se je izdelala v sklopu projekta v podjetju Belimed. Pri testni napravi sem sprva kreiral električno shemo v programu EPLAN Electric P8, namestil mehanske komponente, vgradil električne komponente in jih povezal ter napisal navodila za upravljanje s testno napravo. Na začetku diplomskega dela je opisno predstavljen avtonomni transportni sistem WA290 z vsemi implementiranimi moduli, sledi predstavitev vrste komunikacije, ki je v samem sistemu uporabljena. Nato sem opisal svoje prispevano delo v projektu v kronološkem zaporedju. Z ekipo smo začeli s samo zasnovo testne naprave, kjer smo določili njene osnovne sestavne komponente, postopek namestitve le-teh, zagotovitev potrebnih povezav samih elementov, določili potrebe izgleda in funkcionalnosti za čim bolj optimalno rabo naprave. S kreiranjem električne vezalne sheme sem elektrotehnične elemente ter njihove povezave prikazal v izvedenem projektu, ki služi uporabniku testne naprave za boljše razumevanje delovanja ter mu omogoča enostavnejše popravke ob morebitni napaki ali odpovedi določenega sestavnega dela. Opisan je tudi postopek mehanske in elektro montaže, pri čemer sem opisno izpostavil pomembnejše sestavne dele testne naprave. The diploma thesis describes a design and implementation process of a test device for testing WA290 transport systems for medical washer-disinfection systems, which are products of the company Belimed. The test device consists of the main electrical cabinet A02 and the electrical cabinet A01, which simulates the machine WD290 / WD290 IQ and autonomusautonomous transport module. The testing device is intended for testing individual modules of an automated system. The test device was manufactured as part of a project at Belimed. For the test device, I first created an electrical diagram in the EPLAN Electric P8 program, installed the mechanical components, installed the electrical components and connected them, and wrote instructions for operating the test device. At the beginning of the diploma work, the automated transport system WA290 with all implemented modules is descriptively presented, followed by a presentation of the type of communication used in the system itself. I then described my contribution to the project in chronological order, with the team starting with the design of the test device itself, where we determined its basic components, the process of installing them, providing the necessary connections of the elements themselves, determining the layout and functionality needs for the most optimal use of the device. By creating an electrical wiring diagram, I showed the electrical elements and their connections in a completed project, which serves the user of the testing device to understand the operation and allows him easier corrections in the event of a failure or failure of a particular component. The process of mechanical and electrical assembly is also described, where I have outlined the more important components of the test device.
- Published
- 2021
17. Optimizacija avtomatiziranega stroja za manipulacijo statorjev
- Author
-
BENEDIČIČ, ANDREJ and Klančar, Gregor
- Subjects
pristranskost ,obnovljivost ,linearity ,bias ,ponovljivost ,stator ,avtomatiziran stroj ,stability ,linearnost ,storage ,zalogovniki ,stabilnost ,MSA ,PLC ,repeatability ,automated machine ,reproducibility - Abstract
V prvem delu magistrske naloge je predstavljena optimizacija obstoječega stroja, ki je namenjen za odlaganje zalitih statorjev na paleto na tekočem traku, po katerem se ti odpeljejo na strojno pregledovanje. Statorji so zloženi na pladnjih, ki jih naložene na vozičke zapeljemo v stroj. Servomotorji zalogovnikov s pomočjo prijemal dvignejo pladenj na prenos, ki ga premika dodaten servomotor. Robot pobira vsak stator posebej, ga odnese na mesto odčitavanja QR kode, nato na preverjanje odtenka njegove barve ter na koncu na paleto, ki se nahaja na tekočem traku. Najprej je predstavljenih nekaj mehanskih predelav, ki so bile potrebne za zanesljivejše delovanje stroja. Opisan je program, ki vključuje: izdelavo programskega bloka za premikanje servomotorjev, izdelavo celotnega avtomatskega cikla zalogovnikov in prenosa, optimizacijo ročnega režima stroja, kodo za izvedbo zajemanja meritev pri analizi merilnega sistema senzorja barve ter optimizacijo zaslonov na kontrolnem panelu. Programiranje je potekalo na Siemensovem krmilniku in panelu s pomočjo njihovega programskega okolja TIA Portal. Stroj zajema meritve barvnih odtenkov statorjev, s pomočjo katerih je izvedeno preverjanje njihove toplotne obdelave. Zato je v drugem delu magistrske naloge predstavljena analiza merilnih sistemov, ki jo moramo izvesti na našem senzorju. Merilni sistemi morajo zagotavljati, da pri opravljanju meritev na pride do prevelikih odstopanj od realne vrednosti. Analiza zato merilnemu sistemu preverja stabilnost, ki predstavlja spreminjanje pristranskosti skozi daljše časovno obdobje, pristranskost, ki predstavlja razliko med referenčno vrednostjo in povprečjem nekega števila meritev, linearnost, ki prikazuje razliko pristranskost skozi celotno merilno območje sistema, ponovljivost, ki nam predstavlja razliko med zaporednimi meritvami enega merilca in obnovljivost, ki nam predstavlja razliko med povprečnimi meritvami posameznih merilcev. Merilni sistem našim zahtevam ustreza takrat, ko so vse naštete lastnosti znotraj mejnih vrednosti. The first part of the master's thesis presents the optimization of the existing machine, which is intended for depositing cast stators on a pallet laying on a conveyor belt, after which they are taken for machine inspection. The stators are stacked on trays, which are loaded onto carts, and then together loaded into machine. The storage servomotors lift the tray to the transmission by means of grippers, which is moved by an additional servomotor. The robot picks up each stator separately, takes it to the location of the QR code reading, then to check the hue of its color, and finally to the palette located on the conveyor belt. First, some mechanical modifications that were necessary for more reliable operation of the machine are presented. The program is described with the following: production of a program block for moving servomotors, production of a fully automatic cycle of storage and transmission, optimization of manual machine mode, code for performing measurement capture in color sensor measurement system analysis and screen control panel optimization. Programming took place on a Siemens system using their TIA Portal programming environment. The machine also includes measurements of the color shades of the stators, with the help of which the verification of their heat treatment is performed. Therefore, in the second part of the master's thesis, the analysis of measuring systems is presented, which we must perform on our sensor. Measuring systems must ensure that excessive deviations from the real value do not occur when performing measurements. The analysis of the measuring system checks the stability, which represents the change of bias over time, bias, which represents the difference between the reference value and the average of some measurements, linearity, which shows the bias difference throughout the measuring range of the system, repeatability, which represents the difference between successive measurements of one appraiser and reproducibility, which represents the difference between the average measurements of individual appraisers. Repeatability and reproducibility can be considered together to obtain a variance equal to the sum of the variations within the measurement system. The measuring system meets our requirements when all the listed properties are within the limit values.
- Published
- 2021
18. Optimizirano iskanje poti z RRT-metodami in generiranje gladke poti
- Author
-
Kotnik, Klemen and Klančar, Gregor
- Subjects
inverse path tracking ,vzvratno iskanje ,path reduction ,bidirectional RRT ,reduciranje poti ,Bezierjevi polinomi ,ciljno usmerjeni RRT ,RRT ,Bezier polynomials ,povezovalni RRT ,state transition graph ,časovne nadgradnje ,goal biased RRT ,time upgrades ,graf prehajanja stanj - Abstract
Problematika določevanja optimalne ali kvalitetne poti v prostoru je zahtevna naloga. Ima veliko možnih praktičnih aplikacij, pri čemer je pogosto zahtevan hiter izračun. Računska kompleksnost narašča v odvisnosti od povečevanja števila parametrov, njihovih vrednosti in zahtevnostjo postavitve ovir. Magistrsko delo temelji na uporabi RRT-metod z lastnostjo hitre predstavitve neoptimalnega gibanja po prostoru v obliki grafa prehajanja stanj. Znotraj katerega se določi najboljša pot z uporabo vzvratne metode iskanja poti. Z nadaljnjim reduciranjem odvečnih zavojev oziroma delov poti se pridobljeni poti izboljša kvaliteta. Z Bezierjevimi polinomi se v obliki zvezno gladke poti predstavi reducirana pot za možnost takojšnega sledenja. Izkoristi se hitro določanje neoptimalnega grafa prehajanja stanj z RRT-metodami, z nadaljnjo obdelavo se izboljša pomanjkljivost hitre gradnje s končnim produktom kvalitetne hitro pridobljene poti. V luči pohitritve gradnje RRT-dreves so implementirani nadgrajeni postopki posameznih korakov. S predhodnim definiranjem konfiguracijskega prostora vplivamo na hitrejše preverjanje veljavnosti točk oziroma trka z ovirami, na možnost uporabe iskanja najbližje točke le znotraj želenega dela okolice z namenom zmanjšanja števila preverjenih točk ter na upoštevanje oblike ovire pri ponovnem določanju nove točke, če prvotna točka ali njena povezava leži na oviri. Slednje omogoča učinkovitejše širjenje drevesa ob oviri ali v ozkih prehodih. Eksperimenti potrjujejo učinkovitost uporabe preprostih RRT-metod, brez naknadnega povezovanja bližnjih stanj, v kombinaciji z nadaljnjo obdelavo poti, kar omogoča hiter izračun kvalitetne poti. The problem of determining the optimal or suboptimal path in space is a demanding task with multiple applicability as well as necessity for fast calculation. The computational complexity increases depending on the increase in the number of parameters or their values and the complexity of obstacles arrangement. The master’s thesis is based on the use of RRT-methods with the fast presentation feature of possible non-optimal movement through space in the form of a state transition graph, within which the best path is determined by using the reverse path tracking method. The acquired path quality is further improved by reducing redundant turns and represented with Bezier polynomials in the continuous smooth path form for the possibility of immediate tracking. Therefore with the use of RRT-methods, a non-optimal state transition graph is rapidly yielded and in combination with further processing, of improving the disadvantage of fast construction, a high quality path outcome is thus quickly acquired. In the light of speeding up the construction of RRT-trees, upgraded procedures of individual steps are implemented, such as predefining the configuration space for faster tree node collision checking with a possible nearby obstacle, the choice of using the search for the nearest node only within the interesting part of the area in order to reduce the number of checked nodes and taking into account the obstacle shape when redefining a new node. The latter allows more efficient tree spreading along an obstacle or narrow passages. Experiments confirms the effective use of simple RRT methods, without subsequently linking of nearby states, in combination with further path processing, which allows fast calculation of quality path.
- Published
- 2020
19. Kooperativna vožnja tovornega vozička s kolesnimi mobilnimi roboti
- Author
-
Kambič, Tim and Klančar, Gregor
- Subjects
cooperative driving ,mobilni robot ,load transport ,AGV ,avtonomna vožnja ,autonomous driving ,Gazebo ,prevoz tovora ,ROS ,kooperativna vožnja ,mobile robot - Abstract
Prevoz tovora se v logistiki in proizvodnji ponavadi opravlja z večjimi mobilnimi roboti, ki pa za infrastrukturo niso vedno najbolj primerni. So tudi težki, neokre- tni in zahtevajo veliko prostora, tudi ko ničesar ne prevažajo. V tem magistrskem delu je predstavljen algoritem za prevoz tovora z več manjšimi mobilnimi roboti, ki si tovor delijo. Manjši mobilni roboti so lahko lažji, hitrejši in bolj okretni, če je potrebno lahko učinkovito prevažajo tudi manjše tovore. V primeru večjega tovora pa se roboti s posebnim prijemalom pritrdijo na kolesa tovornega vozička, nase prevzamejo del teže tovora in voziček s tovorom odpeljejo na želeno mesto. Za prevoz tovora med točkami je bil razvit centraliziran algoritem, ki omogoča vodenje poljubnega števila robotov z diferencialnim pogonom. Algoritem je se- stavljen iz treh delov: sistema za izračun kinematike vožnje tovora, sistema za določanje orientacije robotov glede na tovor in dela, ki skrbi za vodenje robotov. Orientacija robotov glede na tovor se izračuna na podlagi treh metod, ki temeljijo na globalni legi robotov, odometriji robotov in kinematičnem modelu ter vizu- alnih markerjih. Za iskanje poti se uporablja algoritem A*, za sledenje poti pa prediktivni algoritem načrtovanja in sledenja trajektorije (Trajectory Rollout). Algoritem pretvori kontrolne ukaze za premik tovora iz algoritma za sledenje poti v kontrolne ukaze za posamezne mobilne robote. Implementacija algoritma temelji na okolju ROS (Robot Operating System). Algoritem je bil razvit in ovrednoten v simulacijskem okolju Gazebo. Nato se je prenesel in ovrednotil še na realnem sistemu – mobilnem robotu podjetja Epilog d.o.o. V simulaciji in na realnem sistemu so bili opravljeni eksperimenti z odprto- in zaprtozančnim vodenjem. Ustrezno delovanje algoritma se je določilo s tremi pokazatelji. Prvi pokazatelj je primerjava hitrostnega ukaza z dejansko hitrostjo tovora. Drugi pokazatelj so sile med roboti in tovorom, tretji pa bočno drsenje robotov. Algoritem je v vseh simuliranih in realnih eksperimentih deloval kar je pomenilo, da se je tovor premikal v skladu z želenimi ukazi brez bočnih drsenj robotov in brez prevelikih sil. Transport of load in production and logistics is usually done with bigger mobile robots that are not always the most suited for infrastructure. They are heavy, slow, and require lots of space even when not transporting anything. This mas- ter’s thesis presents the algorithm for transportation of load with multiple smaller mobile robots that share the load. Smaller robots are lighter, faster, and require less space. If needed they can more effectively transport smaller loads. In the case of bigger load robots use special gripper to attach themselves to the wheels of the transport cart and transfer some weight to themselves. A centralized algorithm was developed that is capable of controlling any num- ber of differential drive robots with the aim of transporting a load between points. The algorithm consists of three parts: a system for calculating kinematics of load transport, a system for determining the orientation of the robots with respect to load and robots control system. The orientation of robots with respect to load is calculated based on three methods that use the global pose of the robots, odom- etry of the robots and kinematic model, and visual markers. For path searching A* algorithm is used and for path following Trajectory Rollout algorithm is used. The algorithm is used to transform control orders for the load to controls for individual robots. The implementation of the algorithm is based on ROS (Robot Operating System) environment. The algorithm was developed and evaluated in Gazebo simulation environ- ment. It was then transferred and evaluated on a real system - on the mobile robot from company Epilog d.o.o. Open and closed-loop control experiments were done in simulation and on the real system. The proper working of the algorithm was determined using three indicators. First indicator in comparison of desired versus real velocity of the load. The second one is the forces between robots and the load. The third is sideways sliding of the robots. The algorithm worked in all simulated and real experiments which meant that the load was moving according to the commands without sideways sliding and without too big forces.
- Published
- 2020
20. Avtonomni zalivalni sistem
- Author
-
Hostnik, Jan and Klančar, Gregor
- Subjects
mikrokrmilnik ,watering system ,microcontroller ,Arduino UNO ,zalivalni sistem ,krmiljenje ,decision algorithm ,algoritem odločanja ,control - Abstract
V diplomski nalogi je predstavljena izdelava avtonomnega zalivalnega sistema, ki je namenjen uporabi za manjše vrtove. Razviti sistem predvideva dva načina zalivanja, ki sta prilagojena specifikam tople grede in vrta. Algoritem se glede na večkrat dnevno izmerjene vrednosti temperature, vlage zemlje, vlage zraka in osvetljenosti odloči ali bo vrt v naslednjih jutranjih urah zaliv ali ne. Na začetku je predstavljen mikrokrmilnik Arduino in strojna oprema našega sistema. V osrednjem delu je opisan razvoj izdelka in koraki po katerih sem izdeloval avtonomni zalivalni sistem. Predstavljeni so tudi izračuni dnevne porabe električne energije razvitega sistema in meritve štirih spremenljivk, ki so ključne pri končnem algoritmu odločanja. Podrobneje je razloženo delovanje algoritma in izvedba s programsko kodo, ki sta ključna dela diplomske naloge. V zaključku so povzete lastnosti razvitega sistema in nakazane so možne izboljšave. In this thesis I present the development of autonomous watering system that can be used in small gardens. The developed system operates in two watering modes which are adapted to the requirements of a garden and a greenhouse application. The algorithm decides to water the garden on the next morning based on the measured values of temperature, soil moisture, air moisture and sunlight, captured several times in the previous day. In the beginning of my thesis I introduce the Arduino microcontroller and our system hardware. In the middle part I describe the development of the product and steps required to implement the autonomous watering system. I also present the calculation of the daily electrical energy requirement of the system and measurements of four main variables used in the decision making algorithm. I explain in more details the operation of the algorithm and the program code which is essential part of my thesis. In conclusion I summarise properties of the developed system and presented the potential improvements of the system.
- Published
- 2019
21. Avtomatizirana zorilnica za meso
- Author
-
LONGO, DOMEN and Klančar, Gregor
- Subjects
zorenje mesa ,relativna vlaga ,temperatura ,Arduino Uno ,senzorji ,temperature ,relative humidity ,dry aging of meat ,sensors - Abstract
Diplomska naloga je opisana izdelava sistema za regulacijo vlage in relativne temperature pri zorenju suhih mesnin. Sistem omogoča operaterju vpogled v veličine znotraj zorilne komore brez, da bi sam posegal vanjo, omogoča tudi spreminjanje teh veličin. Glavni cilj je bil razviti sistem, ki bo z nizko ceno opravljal večino funkcij profesionalnih sistemov za zorenje mesa brez prevelikega človeškega poseganja. Na krmilnik so povezani moduli za izvrševanje regulacije in za komunikacijo z uporabnikom. Glavni del naloge temelji na ustvarjanju programa za krmiljenje in za daljinsko upravljaje samega krmilnika. V prvem delu so predstavljeni elementi sistema in programska oprema povezana z njimi. V drugem delu pa je opisan sam programski del krmiljenja in daljinskega upravljanja ter nadzora krmilnika. Na koncu sledi še preizkus delovanja samega sistema. This thesis describes development of a system for automatic control of temperature and relative humidity with dry aging of meat. System enables user to observe and regulate key properties of the dry aging process. The main purpose of this thesis was to develop a system that enables successful application of the main properties of profesional systems intended for dry aging of meats on a budget and without too much human interference. Controller used in this thesis is connected to modules that actuate on the environment inside dry aging chamber and enable the use of remote controlling the system. The main part of the thesis is based on creating programs for automatic and remote controll of the system. First part consists of a presentation of a key hardware components and software that connects them together. Second part consists of programs descriptions used in the thesis. The final part is a test of the whole system.
- Published
- 2019
22. Planiranje poti avtonomnega vozila pri parkiranju
- Author
-
NIKOLOVSKA, KRISTINA and Klančar, Gregor
- Subjects
mobilni roboti ,AGV ,avtonomna vozila ,path planning algorithm ,autonomous parking ,avtomatizirana skladišča ,algoritem za parkiranje ,avtonomno parkiranje ,automated warehouse ,algoritem za planiranje poti ,parking algorithm - Abstract
Z razvojem avtomatsko vodenih vozil (AGV) in avtomatiziranih skladišč se je razvila potreba po razvoju algoritmov za avtonomno planiranje poti in tudi avtonomnem planiranju poti za parkiranje. Eden od ključnih problemov pri procesu parkiranja je planiranje poti. V tej študiji bo prikazano reševanje problema poti parkiranja štirikolesnega vozila AGV. V teoretičnem delu so predstavljeni trije algoritmi za planiranje poti: Dubinsove poti, RRT (ang. Rapidly-exploring random tree) algoritem in algoritem za iskanje poti s pomočjo krožnih lokov. V praktičnem delu je narejena študija algoritma za iskanje poti s pomočjo krožnih lokov, sam algoritem je implementiran in testiran v simulacijskem okolju. Glavni poudarek je na testiranju delovanja tega algoritma in predstavitvi rezultatov simulacije. Pot, ki povezuje začetno pozicijo AGV s končno pozicijo je sestavljena iz krožnih lokov. Algoritem je testiran v simulacijskem okolju, kjer so dimenzije parkirnega prostora in AGV-ja v naprej določene. Na začetku algoritem najde več kot eno končno krožnico, ki povezuje začetno in končno pozicijo AGV-ja. Krožnica, ki je izbrana kot končna izpolnjuje dva pogoja: radij končnega kroga mora bit večji od radija obračanja (Rturn) AGV-ja in tangentna točka med končno krožnico in krožnico obračanja AGV-ja mora bit nad X-osjo lokalnega koordinatnega sistema. Predlagani algoritem zagotavlja praktično metodo načrtovanja poti brez računsko zamudnega računanja, prav tako pa je sposoben najti končno pot iz katerekoli začetne pozicije AGV-ja. V tej študiji je bilo pokazano, da se dolžina poti spreminja s spreminjanjem naslednjih parametrov: pozicija in orientacija AGV-ja, krmilni kot, parkiranje naprej ali vzvratno. Narejeni so bili štirje optimizacijski algoritmi. Prvi dva algoritma optimirata pozicijo in orientacijo AGV-ja, če poznamo njegov krmilni kot theta. S to optimizacijo dobimo najboljše območje, kjer se lahko parkirni proces začne in tudi najboljšo orientacijo AGV-ja za parkiranje. Tretji algoritem optimira krmilni kot theta, kjer imamo podano začetno pozicijo in orientacijo AGV-ja. S to optimizacijo dobimo krmilni kot, s katerim pridemo do najbolj optimalne (najkrajše) poti. Pri zadnji optimizaciji se preveri način parkiranja (naprej ali vzvratno) s katerim pridemo do najbolj optimalne (najkrajše) poti. S pomočjo vseh optimizacij je bilo ugotovljeno, da je pot najkrajša, ko je začetna pozicija AGV-ja tudi tangenta točka med končno krožnico in krožnico obračanja AGV-ja. Dobra stran algoritma je, da vedno najde pot. Z uporabo različnih vrst optimizacije lahko pot prilagodimo glede na potrebe uporabnika (optimalno pot, ki pomeni najkrajšo pot, ali pot z določenim številom manevrov ali druge).Nadaljnji razvoj algoritma bi lahko vseboval testiranje na realnem primeru v realnem okolju. A path planning algorithm for parking an autonomous vehicle. Recently, with the development of self-driving, autonomous vehicles and automated warehouses there have been a growing interest in the development of autonomous path planning as well as parking algorithms. In this study, a solution for path planning in autonomous parking for 4-wheel-AGV(Automated Guided Vehicle) is presented. In the theoretic part of the study 3 path planning algorithms are exposed such as: Dubbin’s path, RRT (Rapidly-exploring random tree) algorithm and an arc path planning algorithm. In the practical part of the study the arc path parking algorithm is implemented and tasted. The main focus is given to algorithm testing and presentation of obtained test results in simulation environment. The path is circle arc that connects the vehicle initial position and goal position of the vehicle inside the parking space. The algorithm is tested in a simulation environment where parking space and dimension of the vehicle are known. At the beginning from the initial position of the vehicle to the final position the algorithm find more than one potential final circle that can be used to defending the final arc path. But the circle that is picked as final path has to have radius larger than the turning radius of the vehicle and the tangent point between the potential final circle and circles with turning radius of the car have to be above X axis of the local coordinate system. The proposed path planning algorithm provides a practical method of path planning without expensive computation and it was proved that if find a final path from any initial position. In the study it was proved that the length of the final path in changing depending on this parameters: position in orientation of the vehicle, steering angle and parking forward/backward. In the study 4 different optimizations to find the shortest path were done so the optimal path can be found. First one is optimization of the positions and orientations of the vehicle where we know the steering angle thata. With this optimization the best area where the vehicle should start with the parking procedure and path planning and the best orientation of the vehicle are found. Third is optimization of the steering angle theta, where we have the initial starting position and orientation of the vehicle. With this optimization we get what is the best steering angle of the vehicle so we get the optimal path length. And the last optimization is with parking forward/backward. With the optimization it was shown that the length of the path is shortest when vehicle park forward if it is turn with the front side of it to the parking spot. And if it park backward it is better if it is turned with the back towards the parking spot. Also while doing all the optimizations it was shown that the shortest path is found if the tangent point between final circle and circle with turning radius is same as the position point of the vehicle. The good side of the algorithm is that it always find a path, without expensive computations. But the path might not be always optimal, that is why it is good to know the optimization parameter that is important. If it is searching for optimal path meaning the shortest path, or the path with defined number of maneuvers or other optimization. The further work on the algorithm would be implementing and testing in on a real example in real environment.
- Published
- 2019
23. Izvedba algoritma filtra delcev in lokalizacije mobilnega robota Makeblock
- Author
-
ČERNELIČ, ROSANA and Klančar, Gregor
- Subjects
particle filter ,mobilni robot ,system position ,filter delcev ,odometry ,Makeblock ,ultrazvočni senzor ,ultrasonic sensor ,odometrija ,mobile robots ,Arduino ,Arduino IDE ,lega sistema ,Matlab - Abstract
Cilj magistrskega dela je določiti lego mobilnega robota z uporabo algoritma filtra delcev in odometrije v času gibanja v znanem okolju s pomočjo meritev razdalj. Pri tem smo uporabili kit komplet Starter proizvajalca Makeblock in ga nadgradili z ultrazvočnimi senzorji ter optičnimi inkrementalnimi dajalniki. Merilniki na mobilnem robotu pa zaradi fizikalnih omejitev, občutljivosti, ločljivosti in šuma iz okolja vsebujejo negotovost, kar zmanjšuje natančnost ocenjene lege. V magistrskem delu so opisane zgradba mobilnega robota in tehnične lastnosti posameznih sestavnih delov. Podana je ocena meritve razdalje z uporabo ultrazvočnega senzorja. Meritve so prikazane v obliki histograma in normalne porazdelitve ter ovrednotene s primerjavo srednje vrednosti izmerjene razdalje in prave vrednosti pri oviri iz lesa ter plastike. Podani sta tudi meritev hitrosti optičnega inkrementalnega dajalnika in njegova ocena. V zadnjem delu magistrskega dela je opisano modeliranje gibanja mobilnega robota v ravnini, določeno s kinematiko in dinamiko. Opisan je način določevanja lege mobilnega robota, ki je težje določljiva zaradi nedeterminističnosti. Pri tem je opisana izvedba algoritma filtra delcev v znanem okolju. Na koncu smo preverili delovanje algoritma filtra delcev in odometrije ter opisali njuno razliko glede na opravljeno meritev. The objective of this master's thesis is to determine the position of a mobile robot during motion within a familiar environment by means of the particle filter algorithm and odometry, and with the help of distance measurements. To do so, we used the Starter Kit Package by Makeblock, which we upgraded with ultrasonic sensors and optical incremental encoders. On account of the physical limitations, sensitivity, definition, and environmental noise, there is an uncertainty factor to the mobile robot's meters, which inhibits the accuracy of the determined position. This thesis describes the structure of the mobile robot and the technical specifications of its individual components. Laid out are the estimates of the distance measurements made by using the ultrasonic sensor. The measurements are presented by means of a histogram and normal distribution, and are evaluated by comparing the median value of the measured distance and the actual value with a wood or plastic obstacle. Also provided are the measurement of the optical incremental encoder's speed and its assessment. The final part of this thesis presents mobile robot motion modelling on a plane, determined by cinematics and dynamics. The manner of determining the mobile robot's position, which is more difficult to determine due to being non-deterministic, is explained. Also described is the implementation of the particle filter algorithm in a familiar environment. In conclusion, we also checked the functioning of the particle filter algorithm and odometry, describing their differences in terms of the measurements taken.
- Published
- 2018
24. Merilne metode merjenja rotorskega paketa in uporaba Keyence merilnega sistema
- Author
-
BENEDIČIČ, ANDREJ and Klančar, Gregor
- Subjects
Contactless and contact measuring methods ,Keyence TM-3001P ,TIA Portal ,Keyence TM-040 ,Siemens 1212C ,TM-Navigator ,Brezkontaktne in kontaktne metode merjenja - Abstract
V prvem delu diplomske naloge je opisanih več načinov merilnih metod merjenja notranje luknje rotorskega paketa. Deljene so na brezkontakntne in kontaktne metode. Pri brezkontaktnih metodah je naštetih nekaj glavnih lastnosti merilnika Micro – Epsilon boreCONTROL in MBvision Rotor optical system vision ter njuno delovanje v avtomatiziranem sistemu. Pri kontaktnih metodah merjenja so opisana delovanja merilnikov DIATEST BMD, Mitutoyo SERIES 568 in TESA-Hite 400. Naštete so njihove pomembnejše lastnosti ter njihovo delovanje v avtomatiziranem sistemu, če je ta mogoč. V drugem delu diplomske naloge je podrobno opisano delovanje sistema s presvetlitveno kamero Keyence TM-040 in njen krmilnik TM-3001P. Najprej je predstavljena kamera, katera nam s presvetlitvijo vrne dvodimenzionalno sliko predmeta. Nato so našteti vsi vhodi in izhodi krmilnika ter na kratko opisane njihove namembnosti. Natančno je opisano, kako se nastavi program TM-Navigator in predstavljene so vse meritve, katere lahko uporabljamo. Naštete so osnovne lastnosti krmilnika Siemens 1212C in podano je, na katere načine lahko komunicira s krmilnikom Keyence TM-3001P. Za konec je opisano delovanje sistema kot celota in eden od načinov proženja zajemanja slike s programom TIA Portal. In the first part of the thesis a few measuring methods are described of how to measure the inside diameter of a rotor stack. They are divided in contactless and contact measuring methods. At contactless methods some of the main features of Micro – Epsilon boreCONTROL and MBvision Rotor optical system vision and their operations in an automated system are listed. At contact measuring method operations of DIATEST BMD, Mitutoyo SERIES 568 and TESA-Hite 400 are described. Their main features are listed and the possibility of their operation in the automated system is listed too. In the second part of the thesis the operation of the system with lighting camera Keyence TM-040 and its controller TM-3001P are described in detail. At first a camera which gives us a two-dimensional image of a measuring object is introduced. Secondly all the inputs and outputs of the controller are listed and their purpose is briefly described. It is thoroughly explained how to set the settings of TM-Navigator program and there are presented all the measurements for which we can use the program for. Then some of the basic features of controller Siemens 1212C are listed and the ways in which the communication with the controller Keyence TM-3001P is possible are introduced. Lastly the system operation is described as a whole and it is explained how to capture an image with the TIA Portal program.
- Published
- 2018
25. Učni komplet za vodenje sistemov z razvojno ploščo Arduino in Matlabom
- Author
-
KREK, GREGA and Klančar, Gregor
- Subjects
MATLAB ,Simulink ,regulation ,simulation ,simulacija ,regulacija ,PID-regulator - Abstract
V diplomski nalogi je predstavljen učni komplet za delo z razvojno tiskanino Arduino v okolju MATLAB. V glavnem delu je opisana pot do avtomatske regulacije žogice na gredi dolgi 40cm. Regulacija deluje preko programa MATLAB, kamor vpisujemo programsko kodo in programa Simulink, kamor rišemo blokovno shemo. Program MATLAB je preko USB kabla povezan na razvojno ploščo Arduino Uno, katera daje vhodno/izhodne signale sistemu. V prvem delu diplomske naloge se osredotočimo na zaprtozančno PI-regulacijo enosmernega motorja, ki je preko gredi povezan z drugim enosmernim motorjem oz. tahometrom. Posebej izvedemo P in I-regulacijo ter za vsako od regulacij navedemo njene glavne prednosti in slabosti. Simuliramo metodo nihajnega preizkusa in prek znane Nichols-Zieglerjeve metode določimo ojačenja in . Predstavimo model motorja, ki nam poda vse njegove lastnosti. Za lažje računanje modela si pomagamo z Laplace-ovo transformacijo, kjer sta glavni neznanki ojačenje K ter časovna konstanta T. Regulaciji izvedemo s pomočjo enotine stopnice ter preko metode določanja polov. V regulacijo je vključen tudi model sistema, ki prikazuje odziv sistema ob idealnih pogojih. V drugem delu diplomske naloge je predstavljen nadzor pozicije motorja in sicer pri močnostnem menjalniku, kjer je glavna lastnost prepoznavanje pozicije oz. kota gredi, ki je povezana z motorjem. Močnostni menjalnik lahko na vhodu krmilimo s potenciometrom ali s pulznim generatorjem, na izhodu je potenciometer, ki je povezan z motorjem menjalnika in daje podatke na analogni vhod. Podane so osnovne lastnosti sistema drugega reda, kjer uporabljamo PID-regulacijo ter na koncu izpeljanki PI-D in I-PD-regulacijo. Ojačenja regulatorjev so izračunana preko polov sistema, ki jih določimo z enačbo sistema drugega reda. V tretjem delu diplomske naloge uporabimo vse znanje, ki smo ga pridobili iz prvih dveh poglavij. Glavna naloga je regulacija žogice na točno določeni točki na gredi. Pozicijo žogice na gredi spremlja svetlobni senzor, ki oddaja in sprejema infrardeči žarek ter tako določa pozicijo žoge na gredi. Gred uravnava močnostni menjalnik, ki prav tako kot senzor daje podatke mikrokrmilniku na analogni vhod. V prvem delu izvedemo PID-regulacijo, v drugem delu pa uporabimo regulacijo s prostorom stanj. V prostoru stanj določimo spremenljivke stanj ter matrične enačbe, ki določajo relacije med vhodom in izhodom sistema. In the diploma thesis a training kit for working with the development circuit board Arduino in MATLAB environment is presented. The main part describes the development of automatic control of ball on 40cm beam. The control works through the MATLAB program, where we enter the program code and the Simulink program, where we draw a block diagram. The MATLAB program is connected via the USB cable to the Arduino Uno development board, which gives the input / output signals to the system. In the first part of the diploma thesis, we concentrate on the closed loop PI-control of a DC motor, which is connected via a shaft to another DC motor, tachometer. In particular, we perform the P and I-controller, and for each of the control we indicate its main strengths and weaknesses. We simulate the oscillation test method where, through the known Nichols-Ziegler method, we determine the reinforcements and introduce an engine model that gives us all its properties. To facilitate calculating the model, we are using Laplace transformation, where the main unknowns are gain K and the time constant T. The control is performed using the step signal and the pole method. A control system also includes a system model that shows the system's response under ideal conditions. In the second part of the diploma thesis, the control of the position of the engine is presented in the case of a power transmission, where the main characteristic is recognition of the position or angle of the beam that is connected to the engine. The power transmission can be controlled at the input with a potentiometer or with a pulse generator, at the output there is a potentiometer that is connected to the gearbox motor and supplies the data to the analog input. The basic properties of the second-order lag system are given, where we use the PID-control, and finally the derivatives of PI-D and I-PD-control. The controller gains are calculated over the poles of the system, which are determined using the second-order system equation. In the third part of the thesis, we use all the knowledge we have gained from the first two chapters. The main task is to control the ball at a specific point on the shaft. The position of the ball on the beams is accompanied by a light sensor that emits and receives an infrared ray, thus determining the position of the ball on the beam. The shaft controls the power transmission, which, like the sensor, gives the microcontroller data to the analog input. In the first part we carry out the PID-control, while in the second part we use the control in the state space area. In the state space we define the state variables and the matrix equations that define the relations between the input and the output of the system.
- Published
- 2018
26. Končna kontrola izdelkov s sistemom Keyence
- Author
-
GRUM, KRISTJAN and Klančar, Gregor
- Subjects
avtomatsko pregledovanje izdelkov ,final control of product ,izbira objektiva ,postavitev osvetlitve ,končna kontrola izdelkov ,Keyence ,strojni vid ,automatic product inspection ,postavitev kamere ,machine vision ,lighting layout ,camera layout ,lens selection - Abstract
V diplomski nalogi je predstavljena uporaba sistema Keyence pri pregledovanju objektov. Predstavljen je celoten proces uporabe strojnega vida v avtomatiki. Opisano je, kako izberemo ustrezno kamero in objektiv ter za kakšne predmete in pogoje mora imeti kamera določene elemente in lastnosti. Podana je tudi enačba za pomoč pri izbiri objektiva. Navedeni so problemi, ki se pojavijo pri postavitvi kamere ali osvetlitve in rešitve, ki lahko pridejo v pomoč. Prikazanih je tudi nekaj načinov postavitve osvetlitve. Predstavljene so komponente kamere in objektiva, katere moramo poznati, ko ju nastavljamo. Na koncu so tudi praktični primeri, v katerih je bil uporabljen sistem Keyence. V njih je prikazana postavitev kamere in svetilke ter njihove nastavitve. Opisana je tudi uporaba Keyencovih orodji za pregledovanje objektov in nekaj filtrov za izboljšanje kvalitete slike. The disertation presents the use of the Keyence system for objects inspection. The entire process of using machine vision in automation is presented. How to choose the appropriate camera and lens, for which objects and conditions the camera must have certain characteristics and elements is described. An equation to help with the lens selection is given too. Some problems that can appear while setting up the camera and lighting are mentioned but in addition there are also some useful solutions. Ways to set the illumination are shown too. The components of the camera and the lens which we need to know when they are being set are presented. At the end there are practical examples in which the Keyence system is used. The placement and settings of cameras and lamps are also shown. The use of Keyence's tools for objects inspection and some filters in order to improve the quality of the image we captured with the camera are described too.
- Published
- 2017
27. Avtomatizacija akvarija
- Author
-
ŠTEFANIČ BOGOLIN, DANIEL and Klančar, Gregor
- Subjects
mikrokrmilnik Arduino ,avtomatizacija akvarija ,regulacija temperature ,Arduino microcontroller ,ON/OFF regulator ,lighting control ,krmiljenje osvetlitve ,aquarium automation ,dvopoložajni regulator ,servo motor ,temperature regulation - Abstract
V diplomski nalogi je opisana izdelava krmilnega sistema za akvarij, ki omogoča popolno avtomatizacijo le tega. Sistem olajšuje vzdrževanje akvarija in ob enem tudi izboljša življenjske pogoje ribam ter rastlinam. Glavni cilj je bil razviti sistem, ki izpolnjuje vse glavne zahteve za samodejno vodenje akvarija brez človeške pomoči. Vse funkcije posameznih komponent sem povezal z mikrokrmilnikom, ki deluje vzajemno z dajalnikom realnega časa. Tako je zagotovljeno, da se sistem lahko tudi ob prekinitvi napajanja nato vrne v pravilno delovanje. Glavne naloge, ki jih sistem opravlja so: - hranjenje, - regulacija temperature vode, - krmiljenje čistilne naprave, luči ter črpalke za kisik, - prikaz časa in temperature preko LCD zaslona, - prekinitev delovanja filtra v času hranjenja in - zvezno prižiganje luči (simulacija naravnega okolja). V prvem delu naloge je podan opis vseh uporabljenih elementov, ter razlog za njihovo uporabo. V drugem delu je nato opisana njihova implementacija v celotni sistem in način reševanja posameznih problemov pri izgradnji in montaži sistema. Celotni krmilni sistem je trenutno prilagojen za namene uporabe v moji aplikaciji. V primeru bolj kompleksih zahtev je sistem seveda možno prilagoditi in razširiti. These diploma thesis describes the process of making a control system for the aquarium, which enables the complete automation of all functions. The system makes the maintenance of the aquarium easier and also improves the living conditions of both fish and plants. The main goal was to develop a system that fulfils all the main requirements for automatic control of the aquarium without human assistance. All functions of the individual components are linked to a microcontroller that interacts with the real time clock. This ensures that the system can return to the correct operation state even when the power supply is interrupted. The main tasks performed by this system are: - regulation of the water temperature, - feeding, - steering the cleaning system, lights and the Oxygen pump, - displaying the time and water temperature on the LCD screen, - interrupting the power supply for the filter unit between feeding and - continuous signal control of the lights (Simulation of the natural environment). In the first part of these diploma thesis is a description of all the given elements that I have used in my system and it also explains the reasons for their use. The second part then describes their implementation in the entire system. It also makes to show the way of solving individual problems in the construction and installation of the system. The entire control system is currently adapted for use in my specific application. The system can of course be adapted and extended in case of more complex requirements.
- Published
- 2017
28. Uporaba kamere Pixy pri vodenju robota
- Author
-
TITAN, UROŠ and Klančar, Gregor
- Subjects
lens equation ,Pixy ,Lego Mindstorms ,PID regulator ,enačba leče ,PixyMon ,Robotc - Abstract
V diplomskem delu smo obravnavali delovanje kamere Pixy in pokazali, kako je iz podatkov, ki nam jih posreduje, mogoče izračunati razdaljo med kamero in objektom. Za programiranje robota smo v nadaljevanju v programskem okolju Lego Mindstorms EV3 Home Edition opisali funkcijske bloke, povezane s kamero. Opisali smo tudi funkcijski blok za PID regulator in pokazali, kako izračunamo njegove parametre za reguliranje motorjev Lego. V empiričnem delu smo preizkusili praktično delovanje kamere Pixy. Kamero smo pritrdili na robota, sestavljenega iz kompleta Lego Mindstorms, in simulirali lov plenilec–plen. Program smo naredili blokovno v programskem okolju Lego Mindstorms EV3 Home Edition, pokazali pa smo tudi možnost pisanja programske kode v jeziku Robotc. This thesis discusses the operation of Pixy digital camera, and demonstrates the possibility of calculating the distance between the camera and the object, based on the data the camera displays. The main chapters deal with robot programming where function blocks connected with the camera are described by using Lego Mindstorms EV3 Home Edition software environment. The function block for the PID controller has also been described, along with the calculation of its parameters that regulate the Lego motors. In the empirical part of the thesis, Pixy camera operation has been tested in practice. The camera was attached to a robot built from a Lego Mindstorms kit, and the predator—prey hunt has been simulated. The program was developed in Lego Mindstorms EV3 Home Edition software environment, although the possibility of a code-based solution written in Robotc has also been demonstrated.
- Published
- 2016
29. Izdelava robota z večsmernimi kolesi
- Author
-
ZUPANČIČ, GAŠPER and Klančar, Gregor
- Subjects
večsmerno kolo ,Arduino ,robot ,koračni motor ,Omni wheel ,stepper motor - Abstract
Roboti, ki omogočajo gibanje v vse smeri, se imenujejo holonomični roboti. S svojimi štirimi večsmernimi kolesi (Omni wheels) se lahko robot premika ali vrti v vse smeri brez spremembe orientacije. Načrtan je bil tridimenzionalni nosilni okvir mobilnega robota, ki je bil natisnjen na 3D tiskalniku. Nanj so pritrjene komponente robota. Premikanje je bilo realiziramo s koračnimi motorji, ki omogočajo zelo natančno pozicioniranje brez povratne zanke, vse skupaj pa poteka pod nadzorom mikrokrmilnika Arduino Mega. Premik povzročimo z vnosom referenčnih vrednosti, izvrši pa se preko brezžične povezave Bluetooth. Robots that allow movement in all directions, are called holonomic robots. With its four multi–directional wheels (Omni wheels), the robot can move or rotate in any direction without changing its orientation. A supporting frame of the mobile robot was drawn and was then printed on a 3D printer. Robot components are attached to it. The moving was realized with stepper motors, which enable very accurate positioning without any feedback. The motors are controlled with a microcontroller Arduino Mega. The movement is caused with the input of new referent values and is executed via Bluetooth wireless connection.
- Published
- 2016
30. Merilni sistem za samodejno visokotemperaturno in nizkofrekvenčno karakterizacijo dielektričnih materialov
- Author
-
KOS, TOMAŽ and Klančar, Gregor
- Subjects
dielectric permittivity ,dielectric losses ,lock-in ojačevalnik ,ojačevalnik električnega naboja ,LabVIEW ,lock-in amplifier ,PID controller ,dielektrična spektroskopija ,dielektričnost ,dielektrične izgube ,dielectric spectroscopy ,PID-regulator ,charge amplifier - Abstract
Piezoelektrični materiali se kot senzorji, aktuatorji in pretvorniki mehanskih signalov v električne veličine in obratno uporabljajo v širokem območju industrijskih in znanstvenih področij. Trenutno se nekateri najbolj uporabljeni piezoelektrični materiali z visokim piezoelektričnim odzivom depolarizirajo oziroma izgubijo piezoelektrično aktivnost že pri relativno nizkih temperaturah (~ 200 °C), kar onemogoča njihovo uporabo v visokotemperaturnih aplikacijah. Nedavno so različni industrijski sektorji izrazili potrebo po uporabi piezoelektričnih materialov z visoko učinkovitostjo v višjem temperaturnem območju (> 200 °C). Pri razvoju takih piezoelektričnih materialov je potreben vpogled v dinamične električne lastnosti, ki jih je mogoče spremljati z meritvami dielektričnega odziva pri nizkih frekvencah (< 1 kHz). Zaradi visokih cen merilnih sistemov, ki omogočajo vpogled v dielektrični odziv pri nizkih frekvencah, poskušamo v magistrskem delu razviti merilni sistem, ki omogoča samodejno visokotemperaturno in nizkofrekvenčno dielektrično karakterizacijo materialov v frekvenčnem razponu 2 mHz–1 kHz in temperaturnem razponu 25 °C–450 °C. Istočasno mora biti izdelani merilni sistem cenovno ugoden, kvaliteten, omogočati mora vpogled v zahtevane dinamične dielektrične lastnosti materialov, hkrati pa natančen, fleksibilen in z možnostjo karakterizacije velikega obsega merjenih vzorcev. Na osnovi temeljite preučitve prednosti in slabosti poznanih metod dielektrične spektroskopije smo najprej določili primerno metodo nizkofrekvenčne dielektrične karakterizacije. V osrednjem delu prikažemo realizacijo merilnega sistema iz obstoječih elektronskih naprav in sestavnih delov. Ob tem pojasnimo princip delovanja posameznih elektronskih naprav in sestavnih delov, njihove prednosti in slabosti ter njihov namen v izdelanem merilnem sistemu. Nadalje predstavimo izdelano programsko opremo, ki v namen samodejne izvedbe dielektrične karakterizacije v odvisnosti od temperature in amplitude ter frekvence vsiljene napetosti upravlja s strojno opremo realiziranega merilnega sistema. Pri tem so predstavljene izvirne rešitve, ki omogočajo natančno karakterizacijo dielektričnih materialov kljub nekaterim slabostim uporabljenih elektronskih naprav. Nazadnje predstavimo karakterizacijo in testiranje izdelanega merilnega sistema, s čimer so bile preverjene ustreznost delovanja, kvaliteta izdelave in natančnost ter možne izboljšave izdelanega merilnega sistema. V ta namen je bila izvedena meritev dielektričnih vzorcev pri sobni in povišani temperaturi ter primerjava merilnih rezultatov z referenčnim merilnim sistemom in podatki iz strokovne literature. V sklopu tega dela smo pokazali, da so pri karakterizaciji kondenzatorja za profesionalno uporabo z izdelanim merilnim sistemom izmerjene vrednosti faznega zamika (v frekvenčnem območju 2 mHz–100 Hz) v območju vrednosti, ki jo je definiral proizvajalec, in izmerjene vrednosti kapacitivnosti znotraj definirane tolerance kondenzatorja 1 %. As sensors, actuators and interconverters of mechanical signals into electrical quantities, piezoelectric materials are used in a wide range of industrial and laboratory settings. Currently, some of the most widely used piezoelectric materials are those with high piezoelectric responses, but their usefulness only extends over a relatively small temperature range, as at temperatures as low as ~ 200°C such materials depole or lose their piezoelectric activity. Recently, various industrial sectors have expressed the need for the use of piezoelectric devices in high temperature environments (> 200°C), where the piezoelectric materials are also required to have a high piezoelectric response. For the development of such piezoelectric materials insight into their dynamic electrical properties is required, which can be monitored, for example, by measuring the dielectric response at low frequencies (< 1 kHz). Such measurements can be performed by dedicated, commercially available measurement systems, however, efforts to identify high temperature piezoelectric materials sweep a broad range of chemical compositions, structures and properties, thus a novel measurement device was envisaged that could cater to the diverse range of materials properties that need to be explored. This master’s thesis presents the development of a measurement system that enables an automated high-temperature and low-frequency characterization of dielectric materials in the frequency range between 2 mHz and 1 kHz and in the temperature range from room temperature and 450 °C. The following requirements have been defined for the system: i) affordability, ii) high accuracy and iii) flexibility in terms of characterization of various dielectric samples of different dimensions and shape. Based on a thorough examination of the advantages and disadvantages of the available methods of dielectric spectroscopy, in the first part of the thesis we determined the appropriate method for the low-frequency dielectric characterization. In the central part of the thesis, we explain the development of the measurement system, from the existing electronic devices and components, their working principles the related advantages and disadvantages, and their purposes in the developed measurement system. Furthermore, we present a computer software, that was designed within the scope of this thesis to cater to the unique requirements of the equipment and its operation. The software allows for fully automated measurements of the dielectric permittivity as a function of temperature, frequency and amplitude, and incorporates innovative design features that assist with minimizing experimental error and increase the overall accuracy of the measurements. In the final part of the thesis, we present the characterization and testing of the developed measurement system, which allowed us to verify the quality and the accuracy of the system as well as possible improvements. For this purpose, we have measured various dielectric samples at ambient and elevated temperatures and compared the measurement results with a reference measurement system and literature data. Within this work we characterized a standard capacitor (for professional use) using the developed measurement system. We have confirmed that the measured values of the phase shift (frequency range of 2 mHz–100 Hz) are within the range defined by the capacitor manufacturer and that the measured values of the capacitance are within the defined tolerance of 1 %.
- Published
- 2016
31. Zasnova pametne inštalacije za vinogradniško zidanico
- Author
-
KREJAN, DEJAN and Klančar, Gregor
- Subjects
daljinsko upravljanje ,vinogradniška zidanica ,regulacija temperature ,Pametna inštalacija ,remote control ,Arduino ,Smart installation ,vineyard cottage ,temperature regulation - Abstract
V diplomskem delu je predstavljena zasnova enostavnega sistema pametne inštalacije za že postavljen objekt, ki služi namenu vinogradniške zidanice. Zasnovan sistem omogoča centralni kot tudi daljinski dostop in nudi upravljanje in spremljanje različnih naprav v objektu, regulacijo temperature v prostorih ter spremljanje postopka fermentacije. Zaradi specifike objekta so rešitve prilagojene potrebam objekta, ki so predstavljene v začetnem delu naloge. V nadaljevanju je v več sklopih predstavljena strojna in programska oprema uporabljena za izdelavo sistema, ter njegova predstavitev delovanja. Prikazana je tudi izgradnja modela regulacije temperature v prostoru in opisana izdelava ter delovanje uporabniškega vmesnika in tudi njegova povezava s centralno krmilno enoto. Za centralno krmilno enoto je uporabljen mikrokrmilnik Arduino, ki je cenovno dostopen, obenem pa dovolj zmogljiv za obseg našega sistema. Sistem pametne inštalacije je bil razvit do prototipne izvedbe in testiran. Z vključitvijo nekaj dodatkov in izboljšav bi bil pripravljen za vgraditev v objekt. This thesis presents the basis of a simple smart installation system used in a already placed building, which purposes as a vineyard cottage. This system enables both central and remote approaches and also provides management and observability of different appliances in the building, temperature regulation and observation of the fermentation process. Due to its specifics, the solutions are adjusted to the needs of the building, which are presented in the beginning of this thesis. Succeeding in the next chapters, hardware and software equipment used for the construction of the system and also its presentation is presented. The construction of the temperature regulating model for the room is also presented. So is the description of the operation of the user interface and its connection with the central control unit. For the central control unit I used the Arduino microcontroller, which is affordable and at the same time powerful enough for the capacity of our system. The smart installation system was developed up to the prototype phase and tested. With inclusion of some accessories and improvements it would be prepared for installation.
- Published
- 2016
32. Planiranje gladke poti mobilnega vozila z uporabo hibridnega algoritma A*
- Author
-
VODNIK, DAVID and Klančar, Gregor
- Subjects
mobilni robot ,pathfinding ,iskanje poti ,Ackermann model ,hibridni algoritem A ,hybrid A* algorithm ,mobile robot - Abstract
Delo opisuje implementacijo hibridnega A* algoritma za iskanje gladke poti mobilnega vozila. Cilj je bil poiskati in uspešno prevoziti pot, ki zadosti neholonomičnim omejitvam realnega vozila v prostoru obdanem z ovirami. Izdelana je bila simulacija v programskem okolju Unity, ki je pogosto uporabljeno za izdelavo računalniskih iger in omogoča dobro vizualizacijo sledenja poti mobilnega vozila. Simulacija vsebuje primer realnega prostora z ovirami, med katerimi se mora vozilo prebiti od začetne do ciljne pozicije. Izdelana je bila preprosta simulacija laserskega senzorja za kartiranje okolja, Ackermannov model vozila, hibridno A* iskanje in vodenje vozila po dobljeni poti. The thesis describes the implementation of the hybrid A* algorithm with the aim of finding a smooth path in an obstacle dense environment. The goal was to find and successfully folow a path that meets the nonholonomic restrictions of a real vehicle. A simulation was developed in the Unity framework that is often used in game development and allows for a good visualization of mobile vehicle path following. The simulation consists of an example of a space with obstacles among which the vehicle has to travel from a start to a goal location. A simple laserscanner simulation was developed for mapping the environment, an Ackermann vehicle model, hybrid A* search and path following.
- Published
- 2016
33. Povezava simulatorja leta X-plane z okoljem Matlab-Simulink
- Author
-
KUNSTELJ, ANŽE and Klančar, Gregor
- Subjects
PlaneMaker ,X-Plane ,izgradnja blokov ,UDP communication ,Simulink ,flight animation ,aircraft model ,aircraft control ,animacija leta ,vodenje letala ,UDP komunikacija ,model letala ,Matlab ,block construction - Abstract
V delu je predstavljen simulator X-Plane, ter program PlaneMaker, ki je del paketa X-Plane. Primer izgradnje modela letala Cessna 172 s programom PlaneMaker opisuje način definiranja vseh ključnih elementov, pomembnih za uspešen polet v simulatorju. Jedro diplomske naloge predstavlja izdelava UDP komunikacije med simulatorjem X-Plane in okoljem Matlab-Simulink. Programski del komunikacije je zgrajen v C/C++ jeziku, dopolnjen z elementi Matlab kode, ki omogoči uporabo v Simulink blokih. Izdelani so bili štirje bloki. Dva služita komunikaciji z namenom vodenja in dva animaciji leta. Za vrednotenje izdelane komunikacije z namenom vodenja, je bil v Simulinku narejen avtopilot. In this paper I present the simulator X-Plane, and PlaneMaker program, which are part of the X-Plane package. The example of the Cessna 172 model aircraft construction in the program PlaneMaker, describes a method of defining all the key elements important for a successful flight in a simulation. The base of this thesis is the development of UDP communication between the simulator X-Plane and the environment of Matlab-Simulink. The programmable part of the communication is built in C/C++ language, supplemented with elements of Matlab code, which enables the use of Simulink blocks. Four blocks were made of which two serve for the purpose of controlling the aircraft and the remaining two for flight animation. This Simulink autopilot was made for the evaluation of communication, which was used for the purpose of aircraft control.
- Published
- 2016
34. Lokalizacija mobilnega robota v znanem okolju z uporabo merilnikov razdalj
- Author
-
GERČAR, MARJAN and Klančar, Gregor
- Subjects
particle filter ,global localisation ,histogram filter ,Lokalizacija mobilnega robota ,Bayes filter ,filter delcev ,Bayesov filter ,Monte Carlo lokalizacija ,algoritmi za verjetnostno porazdelitev ,Mobile robot localisation ,probabilistic distribution algorithms ,grid localisation ,Monte Carlo localisation ,globalna lokalizacija ,mrežna lokalizacija - Abstract
Enega temeljnih problemov v mobilni robotiki predstavlja lokalizacija mobilnega robota, saj je uspeh, da se le-ta dobro lokalizira, povezan z različnimi dejavniki. Osnovni pojem pri obravnavani tematiki, predstavlja verjetnost, na temelju česar je tudi nastala verjetnostna robotika, katere verjetnostne teorije so popularne in izredno uspešno uporabljene v praksi. Njihova prednost je predvsem ta, da upoštevajo negotovosti, tako pri izračunih kot tudi pri načrtovanju sistema ter tudi, da z njihovo pomočjo lahko z verjetnostno porazdelitvijo predstavimo stanje nekega sistema. V diplomskem delu sem se osredotočil na splošen problem globalne lokalizacije, katera predstavlja problem znanega zemljevida ter neznane začetne lokacije robota. Za reševanje omenjenega problema je pomembno, da poznamo lokalizacijske algoritme, ter njihove osnove. Algoritmi izračunavajo verjetnostno porazdelitev, tako da je lokalizacija mobilnega robota uspešna. Za namene diplomskega dela sem izvedel dva projekta, pri katerih sem uporabil dva verjetnostna algoritma, histogram filter ter filter delcev. Oba izhajata iz Bayesovega filtra, ki obenem predstavlja izhodišče za vse verjetnostne algoritme. Prvi za predstavitev verjetnostne porazdelitve uporablja diskretno mrežno lokalizacijo (v definirani mreži celic), drugi pa uporablja zvezno Monte Carlo metodo lokalizacije. One of the core problems in mobile robotics is the localisation of the mobile robot, as the success rate of achieving localisation depends on many different factors. The core idea with my chosen topic is represented by probability, which advanced into its own field of robotics – probabilistic robotics, of which theories are incredibly widespread and popular in practice. Their advantage lies mainly in acknowledging uncertainties in calculations, system planning and in presenting the state of a certain system through probabilistic distribution The focus of my thesis is in the general problem of global localisation, which represents the problem of the known map and unknown starting location of the robot. In order to solve the aforementioned problem it is important to have knowledge of the localisation algorithms, which calculate the probabilistic distribution in a manner that leads to the successful localisation of a robot. In support of my thesis I engineered two projects, which used two probabilistic algorithms: a histogram filter and a particle filter. Both descend from the Bayes filter, which represents the foundation for all probabilistic algorithms. The former algorithm uses, for the purposes of probabilistic distribution, a discreet grid localisation (in a defined grid cell) while the latter uses the Monte Carlo localisation method.
- Published
- 2016
35. Vodenje in nadzor naprav z mikrokrmilnikom Arduino
- Author
-
MANDELJC, PETER and Klančar, Gregor
- Subjects
HTML ,JavaScript ,control loop ,protected network ,Notepad++ ,HTML5 ,AtMega2560 ,research and development ,Ethernet Shield ,Visual Studio ,firmware ,server ,Arduino ,C++ ,Make ,Arduino Mega ,PID ,krmiljenje ,regulacija ,Makefile ,mikrokrmilnik ,oddaljeni nadzor ,compile ,regulator ,remote control ,microcontroller ,flash ,memory card SD ,client ,RC - Abstract
Diplomska naloga opisuje razvoj aplikacije za regulacijo zahtevnejših procesnih naprav z regulatorjem »PID«. Regulator je bil zasnovan na tak način, da je bila nadzor in regulacija mogoča iz oddaljene lokacije preko internetne povezave. Pri izdelavi sem se omejil na enega uporabnika in predpostavljal, da se aplikacija nahaja v nekem zaščitenem omrežju. To pomeni, da zadeva ni bila popolnoma varna za uporabo v javnem omrežju. Izdelek je temeljil na mikrokrmilniških ploščah znamke »Arduino«. V začetnem času razvoja je bila uporabljena plošča modela »Uno«. Le ta se je že zelo kmalu izkazala za neprimerno. Zaradi tega sem se kasneje odločil za model »Mega«, ki je bil zasnovan na mikrokrmilniku »ATmega2560«. Za komuniciranje prek internetne povezave, ter za uporabo spominske kartice SD, je bila uporabljena razširitvena plošča »Ethernet Shield«, katera je bila kompatibilna z obema uporabljenima tiskanima vezjema. Programska koda se je delila na dva dela in sicer na internetno stran uporabniškega vmesnika (HTML5, JavaScript) in programsko kodo mikrokrmilnika (C++). Koda je bila napisana v brezplačnem programu »Visual Studio Community 2015«, katera se je prevajala in nalagala v bliskovni pomnilnik s pomočjo programskega orodja »Make.exe« in uporabo programske skripte »Makefile«. Internetna stran je bila razvita z brezplačnim urejevalnikom besedil »Notepad++«. Celotni sistem je v začetnem načinu deloval navzven kot strežnik internetne strani. Po uspešni povezavi se je internetna stran prenesla k uporabniku. Povezava se je zatem prekinila, prenešena stran pa je pričela delovati kot klient, povezana na strežnik mikrokrmilnika. Po prenesenem uporabniškem vmesniku, je uporabnik lahko pričel z nadzorom in manipulacijo regulatorja. This thesis describes the process of research and development of a control loop feedback device (regulator) “PID”, which can be remotely controlled over internet connection. In the development process, I have limited the application to one user only and assumed that it is connected in a closed or protected internet environment. As such, the final product was not completely safe to use in a public network. Application was based on “Arduino” microcontroller board. The development of the application began with usage of board model “Uno”, but was soon replaced with model “Mega”, due to microcontroller limitations. Arduino Mega was based on “ATmega2560” microcontroller. For internet communication and the ability of memory card SD, expansion board Arduino “Ethernet Shield” was used in both microcontroller board cases. Programming code was split in two parts. First part was webpage code in HTML5 and JavaScript. The second part was microcontroller program (firmware), written in C++. Webpage was written with usage of free editing software “Notepad++”. Microcontroller firmware was written in free editor “Visual Studio Community 2015”. Firmware was compiled and uploaded to flash memory with “Make.exe” tool and script called “Makefile”. Regulator software in first state functioned as a webpage server of user interface. When client connected, webpage was transferred to him and connection was terminated. After termination, webpage immediately connected back to the regulator. The application was then ready for remote control.
- Published
- 2016
36. Nadgradnja stroja za krivljenje cevi
- Author
-
KOVAČIČ, URBAN and Klančar, Gregor
- Subjects
evropske direktive ,axes control ,bending machine upgrade ,nadgradnja krivilnega stroja ,Siemens Sinumerik 828D ,analogno regulirana os ,analogue axis control ,PROFINET ,machinery safety ,DRIVE-CLiQ ,european directives ,numerical control ,programirljiv logični krmilnik ,regulacija osi ,varnost stroja ,programmable logic controller ,numerično vodenje - Abstract
Starejši CNC krmilniki so postali premalo zanesljivi za uporabo v industrijskih okoljih, kjer so vedno pomembnejši hitrost, zanesljivost in zmožnost hitrega odpravljanja napak. Zaradi tega se podjetja odločajo za zamenjavo celotnih strojev ali v primeru, da so le-ti mehansko še dovolj dobri, za njihovo nadgradnjo, saj to navadno predstavlja manjšo finančno investicijo. Diplomska naloga opisuje nadgradnjo stroja za krivljenje cevi italijanskega proizvajalca BLM Plauno. Glavni namen je bila zamenjava orginalnega Bosch CNC krmilnika s krmilnikom Siemens Sinumerik 828D. Izdelana je bila nova elektro omara, saj so bili zaradi združljivosti s krmilnikom zamenjani tudi pogoni osi in ostala elektro oprema. Za stroj je bil napisan nov program na PLK, določeni so bili parametri za optimizirano delovanje pogonov osi in izdelan je bil uporabniški program v G-kodi, glede na katerega stroj oblikuje cev. Ob predelavi je bilo poleg zahtev naročnika potrebno upoštevati tudi slovenske ter evropske pravilnike in standarde. Older CNC controls have become insufficiently reliabile for use in industrial environments, where speed, reliability and the ability of rapid troubleshooting is more and more important. For that reason the companies have been deciding to replace the machines or, if they are mechanically still good enough, to upgrade them since this represents a smaller financial investment. This bachelor thesis describes the upgrade of a tube bending machine, manufactured by BLM Plauno from Italy. The main purpose of the upgrade was the replacement of the original Bosch CNC controller with the Siemens Sinumerik 828D controller. Since axes drives and other electrical equipement were also replaced, a new electrical cabinet was designed to provide compatibility of the components with the controller. A new PLC program was made, parameters for optimized axes operation were set and a user program in G-code, according to which tubes are bent, was created. During the upgrade Slovenian and European regulations and standards had to be considered beside the customer's requirements.
- Published
- 2016
37. Izdelava pretaljevalne pečice za spajkanje SMD vezij
- Author
-
STERGAR, ANDREJ and Klančar, Gregor
- Subjects
Pretaljevalna pečica ,Reflow oven - Abstract
V diplomskem delu je bil cilj predelati nizkocenovno gospodinjsko pečico v pretaljevalno pečico za spajkanje komponent na tiskani plošči. Pečica bo uporabljena za delo v laboratoriju fakultete. In the thesis the aim was to recover low-cost household oven in reflow oven to solder components to the circuit board. The oven will be used for work in the laboratory of the faculty.
- Published
- 2016
38. Regulacija sistema centralnega ogrevanja z razvojno ploščo Arduino
- Author
-
LESKOVEC, ANŽE and Klančar, Gregor
- Subjects
mikrokrmilnik ,microcontroller ,Arduino ,regulation ,development board ,regulacija ,razvojna plošča - Abstract
V diplomskem delu smo želeli prilagoditi in optimirati regulacijo kroženja vode med centralnimi elementi sistema ogrevanja. Da bi regulacijo lažje prilagodili našim željam in potrebam, smo se odločili, da za krmilno enoto uporabimo mikrokrmilnik Arduino Mega 2560, ki temelji na odprtokodni platformi. Zanj smo se odločili predvsem zaradi dostopne cene, poenostavljenega programskega jezika in veliko prek spleta dostopnega gradiva o njegovem programiranju ter povezav elektronskih elementov. Na začetku dela so opisane prvotna regulacija in pomanjkljivosti, katere smo želeli odpraviti. Nato smo opisali želeni način delovanja nove regulacije. Nadaljevali smo z opisom uporabljene strojne opreme. Opisali smo tudi Arduino platformo in programsko kodo, napisano v programskem jeziku, prilagojenem Arduino mikrokrmilnikom. Na koncu dela sta opisani še končna izdelava in namestitev izdelka. Tako smo izdelali krmilno enoto, katere tako strojni kot tudi programski del je naše delo. This diploma thesis discusses how the authors adapted and optimised the regulation of water circulation within the central components of the selected heating system. In order to adapt the regulation to the needs and demands of consumers, the authors employed the microcontroller board Arduino Mega 2560 which is based on open-source software. This board was selected due to its reasonable price, simplified programming language and a large amount of online material discussing the programming and the interconnection between the electronic elements within the board selected. The first part of the thesis discusses the original regulation and the disadvantages that were supposed to be eradicated via the method selected. The continuation discusses the desired method of the new system of regulation. This is followed by the description of the employed hardware. The thesis also describes the Arduino platform and the source code written in the programming language that was especially adapted to the microcontroller board selected. The last part of the thesis discusses the final manufacturing and the installation of the unit under consideration. The complete unit, the hardware and the software were all manufactured by the authors of this thesis.
- Published
- 2015
39. Robotski vodič po galeriji
- Author
-
PEČOLER, MARKO and Klančar, Gregor
- Subjects
programming environment ,guide ,laserski pregledovalnik razdalj ,vodič ,laser range finder ,robot ,uporabniški vmesnik ,user interface ,map ,gallery ,programsko okolje ,galerija ,zemljevid ,C++ - Abstract
Potrebe po robotizaciji se nenehno večajo. Zato bi lahko robotizacijo prenesli tudi v okolja, kjer še ni tako domača, na primer v galerije. Zato sem razvil uporabniški vmesnik za robotskega vodiča, ki je izveden na štirikolesnem robotu Pioneer P3-AT proizvajalca MobileRobots. Po uvodni predstavitvi problema je v drugem poglavju podan opis funkcionalnosti sistema in razvoj vmesnika. Vmesnik je napisan v programskem okolju Borland C++ Builder 5 in programskem jeziku C++. Namen vmesnika je enostavno sestavljanje vodenih ogledov v galerijah. Za testiranje vmesnika v začetnih fazah sem uporabljal simulatorje, ko pa je bil vmesnik dovolj razvit, sem vse skupaj preizkusil še na robotu. V diplomskem delu so opisana uporabljena orodja, programsko okolje, štirikolesni robot in način izvedbe diplomske naloge. The need for robotization is constantly increasing. Therefore, robotics could also be transferred to the environment where it is not so familiar, for example Gallery. That is why I developed the user interface for robot guide that is four wheel robot Pioneer P3-AT from MobileRobots brand. After initial problem presentation a description of the system functionality and interface development is given in the second chapter. The interface is written in programming environment Borland C ++ Builder 5 and in programming language C ++. The purpose of the interface for simple assembly of guided tours in the galleries. To test the interface in the early stages I was using simulators, but when the interface was sufficiently developed I have tried the whole thing on the robot. In this graduation thesis are described used tools, the programming environment, four wheel robot and the method of implementation graduation thesis.
- Published
- 2015
40. Daljinsko upravljanje železniškega prometa
- Author
-
ZORETIĆ, MARIO and Klančar, Gregor
- Subjects
CENELEC SIL 4 ,CTC TRIS SIL 4 ,RTU ,SilWorks ,POLL ,CRC - Abstract
V diplomski nalogi bom predstavil izvedbo daljinsko vodene enote (RTU – Remote Terminal Unit) za potrebe upravljanja železniškega prometa po standardu CENELEC SIL 4. V prvem delu naloge bodo opisane zahteve končnega uporabnika in standardov, ki zahtevajo specifično znanje železniškega prometa ter pisanje obširne dokumentacije med izvajanjem projekta, opisal bom uporabljene metode za zagotovitev visoke varnosti, ki jih zahtevajo standardi, prav tako pa bom predstavil tudi ključen pomen diagnostike pri sistemu CTC TRIS SIL4. V drugem delu bom predstavil programsko opremo SilWorX in strojno opremo Hima, programsko rešitev izvedbe RTU-ja s posebnim poudarkom na komunikaciji med RTU-jem in strežnikoma s POLL rešitvijo in nenehnim preverjanjem CRC (Cyclic Redundancy Check) izračuna, sledila bo predstavitev tabel CSV, s katerimi se ob uvozu v program SilWorX generira avtomatsko (glede na podane podatke), na koncu pa bom navedel še primer testiranja programa. This thesis presents the performance of Remote Terminal Units (RTU) for the purpose of rail traffic management according to CENELEC SIL 4 standard. The first part describes the end-user requirements and standards, which requires specific knowledge of rail traffic, writing extensive documentation throughout the project, the use of methods to ensure high safety, required by standards, and the crucial importance of diagnostics through the CTC TRIS SIL4 system. The second part presents the SilWorks software and the Hima hardware, a software solution of the RTU performance with special emphasis on the communication between RTU and servers with POLL solution and Cyclic Redundancy Check (CRC), presentations of the CSV tables, that help the SilWorks program to generate automatically according to the given data upon importation into SilWorks program, and at the end an example of testing the program.
- Published
- 2015
41. Izvedba avtomatizacije ogrevanja hiše s spletnim uporabniškim vmesnikom
- Author
-
KODELJA, TADEJ and Klančar, Gregor
- Subjects
web server ,spletni strežnik ,house heating system ,Arduino ,ogrevanje hiše - Abstract
V zaključnem delu je opisana avtomatizacija ogrevanja hiše z mikrokrmilnikom Arduino. Projekt je nadgradnja prejšnje izvedbe avtomatizacije, kjer se je parametre delovanja vpisovalo ročno in krmilnik ni bil povezan v omrežje. Z dodanim Ethernet modulom in povezavo v omrežje se parametre vpisuje preko grafičnega uporabniškega vmesnika, ki je osnovan na spletnem strežniku in HTML strani. Prav tako se v ročnem režimu lahko poljubno vklaplja in izklaplja vodne črpalke, ki v avtomatskem režimu delujejo po določenem algoritmu vodenja. Poleg tega nam uporabniški vmesnik omogoča izrisovanje grafov merjenih temperatur v odvisnosti od časa, shranjevanje grafa na računalnik, ter z indikatorji pove, ali je določena vodna črpalka vklopljena ali izklopljena. Ključne The thesis adresses automation of house heating system with microcontroller Aduino. Project is an upgrade of before made automation, where you had to define parameter values manually and microcontroller wasn't connected to network. With addition of Ethernet shield and network connection are parameters defined over graphical user interface based on a web server and HTML page. In manual mode you can turn on or off water pumps by pressing the corresponding switches. In automatic mode pumps work by defined control algorithm. Beside all that it allows to draw graph of measured temperatures in date periods, saving the graph to your computer and with indicators telling us the state of water pump.
- Published
- 2015
42. Visoko regalno skladišče za skladiščenje plastičnih folij
- Author
-
GLAVAČ, PRIMOŽ and Klančar, Gregor
- Subjects
High-rack warehouse ,nadzorni sistem (SCADA) ,PLK ,algoritmi ,control systems (SCADA) ,Regalno skladišče ,algorithms - Abstract
V podjetju Etra d.o.o. se ukvarjamo z avtomatizacijo in robotizacijo industrijskih procesov. Podjetje Etra d.o.o. je na tržišču prisotno že več kot 20 let in je eno izmed vodilnih podjetij, ki ponujajo celovite industrijske aplikacije na slovenskem in tujem tržišču. Projekt, pri katerem sem sodeloval, je bila izdelava avtomatiziranega visokega regalnega skladišča, od načrtovanja do končne izvedbe. Magistrska naloga zajema opis regalnega skladišča, ki služi za shranjevanje bal plastične folije. Skladišče omogoča skladiščenje do 2300 palet različnih dimenzij. Podrobneje so opisani algoritmi razvrščanja palet in delovanje nadzornega sistema. V nalogi je opisana uporabljena strojna oprema vezana na električni in programski del. Opisan je Siemensov krmilnik S7-414 in komunikacijski protokoli, preko katerih komunicira s perifernimi enotami. Prav tako je opisana programska oprema za programiranje krmilnikov (STEP7) in nadzornih sistemov (WinCC). V nadaljnjih poglavjih so opisane in orisane metode in algoritmi za avtomatsko delovanje skladišča. Delovanje slednjega je integrirano v naročnikov delovni proces tako, da ne povzroča dodatnih stroškov in časovnih zakasnitev. Algoritmi zlaganja omogočajo dinamično kreiranje položaja odlagalnih celic, s čimer dosežemo večjo gostoto shranjevanja izdelkov in večjo prilagodljivost glede na velikost izdelkov. Obenem skrbijo za sortiranje enakih oziroma podobnih izdelkov skupaj, s čimer optimiziramo delovanje skladišča. Pri zahtevah za izvoz palet algoritmi pobiranja poskrbijo za nemoteno dobavo izdelkov. Hkrati omogočajo različne strategije pobiranja, in sicer pobiranje po izbrani paleti, po delovnem nalogu, po najstarejšem tovoru ipd. Skladišče je avtonomno, operaterji pa komunicirajo in podajajo zahteve izključno preko internega logističnega sistema. The company Etra d.o.o. works in the field of automatisation and robotisation of industrial processes. Etra d.o.o. has been present on the market for over 20 years and is one of the leading companies offering comprehensive industrial applications on the Slovenian and foreign markets. The aim of project I participated in was to design an automated high rack warehouse, from the planning to the final implementation phase. This Master's thesis includes a description of the rack warehouse, which serves to store bales of plastic sheeting. The warehouse enables storage of up to 2,300 pallets of various dimensions. The paper elaborates on the classification algorithms for pallets and the control system operation. This paper firstly describes the hardware attached to the electrical and software parts. It also includes a description of the Siemens S7-414 controller and communication protocols that are used for the communication with peripheral units and a description of the software for PLC programming (STEP 7) and control systems (WinCC). Subsequent chapters describe and outline the methods and algorithms for automatic warehouse operation. The warehouse is integrated into the client’s working process, so that it does not cause additional costs and time delays. Stacking algorithms allow a dynamic creation of storage cell positions, which results in higher density of stored products and increases flexibility in regards to product size. At the same time the algorithms sort identical or similar products together, thereby optimizing the operation of the warehouse. Collection algorithms ensure smooth supply of products in accordance with all export requirements. At the same time they allow different collection strategies, for example the collection of the selected range, according to the work order, the oldest cargo, etc. The warehouse is autonomous and the operators communicate and pass on their requirements exclusively through the internal logistics system.
- Published
- 2015
43. Avtomatska naprava za izdelavo lovne hrane za krapolov
- Author
-
BERGER, MIHA and Klančar, Gregor
- Subjects
avtomatizacija naprave ,programed PID control ,izdelava vab za krape ,device automation ,making baits for carp ,programska PID regulacija - Abstract
V diplomski nalogi sta predstavljena načrtovanje in izdelava avtomatske naprave za izdelavo lovne hrane za krapolov z uporabo sodobnih mikroprocesorjev. Izdelava tovrstne vabe je zahtevno in zamudno opravilo, zato ga je smiselno avtomatizirati. V delu sta opisana konstruiranje in izvedba mehanskih sestavnih delov naprave. Za pogon valjev je bil uporabljen obstoječi elektromotor, kateremu smo najprej ocenili dejansko nazivno moč in nato izračunali največjo potrebno moč za pogon naprave. Program za izvedbo avtomatizacije smo izvedli na razvojni tiskanini Raspberry Pi model B. Regulacijo hitrosti vrtenja valjev smo izvedli z regulatorjem PID, kjer hitrost vrtenja osi motorja merimo z magnetnim enkoderjem in preko razvitega močnostnega vezja reguliramo hitrost vrtenja motorja. Za lažje upravljanje naprave je bil razvit uporabniški vmesnik v Python3.x programskem okolju. V zaključku so podane nadaljnje možne izboljšave naprave. The thesis includes the plans as well as the realisation of an automated microprocessor-based device for the production of food used as bait in carp fishing. This type of fishing bait production presents a demanding and time-consuming task, thus it is sensible to automate it. The thesis covers the entire process of constructing and manufacturing the mechanical components of the device. To build the roller drive, an existing electric motor has been used. Initially, I have estimated its actual rated power and afterwards calculated the maximum power needed to operate the device. The programme for executing the automation process has been applied to the Raspberry Pi model B printed circuit board. Using a PID controller I have controlled the rotation speed of the rollers by measuring the rotation speed of the axis of the electric motor with a magnetic encoder, thereby controlling the rotation speed of the motor through the constructed power circuit. Using the programming language Python3.x I have developed a user interface for easier operating of the device. The conclusion presents further possibilities for improving and upgrading the device.
- Published
- 2015
44. Nov način simuliranja občutka vožnje
- Author
-
Zajc, Matic and Klančar, Gregor
- Subjects
simulator vožnje ,driving simulator ,simulating the sensation of movement ,simuliranje občutka vožnje - Abstract
To diplomsko delo predstavlja nov način simuliranja občutka vožnje. V ta namen na trgu obstajajo različni simulatorji. Tem je skupno, da za generiranje sile uporabljajo gravitacijo, kar za seboj prinese številne omejitve, predvsem pri simuliranju dolgotrajnih pospeškov. Naš način simuliranja občutka vožnje pa deluje na principu generiranje sile na glavo uporabnika s pomočjo aktuatorjev. V prvem delu si bomo na kratko ogledali zgodovino razvoja simulatorjev. Simulatorji so bili v zadnjih desetletjih deležni obsežnega razvoja, vendar se do današnjega dneva srečujejo z istimi problemi in izzivi. Nov način simuliranje občutka vožnje pa se srečuje s čisto drugačnimi. Nov način simuliranja občutka vožnje generira enako silo na glavo uporabnika, kot bi jo čutil uporabnik v dejanskem vozilu. Simulator oz. diplomsko delo je sestavljeno iz več sklopov, ki skupaj delujejo kot zaključena celota. Prvi skop opisuje različne aktuatorje za generiranje sile. Izbira aktuatorja močno vpliva na naslednji sklop, izbiro krmiljenja oz. regulacijo aktuatorja. Simulacije so pokazale, da v primeru izbire enosmernega krtačnega motorja, najboljše rezultate daje regulacija sile z neposrednim merjenjem le te. V ta namen si bomo ogledali tudi princip merjenja sile, ki se generira med vodili in uporabnikom. Za generiranje kakršnekoli sile potrebujemo napetostni vir. Pri izbiri enosmernega krtačnega motorja je zahtevana moč napajalnega vira visoka, to močno vpliva ceno. Za napajalni vir smo zato izbrali kar dva računalniška napajalnika, ki skupaj dajeta 24V napetost in s tem krmilita naš aktuator. Zadnji in najpomembnejši sklop pa predstavlja programski del, ki je sestavljen iz dveh programov. Glavni program deluje skupaj s simulacijsko igro, njegova naloga je v najkrajšem možnem času pošiljati podatke iz simulacije na krmilnik Netduinu. Program, ki se nahaja na Netduino, pa sprejema te podatke ter s pomočjo merjenja sile med uporabnikom in vodilom ustrezno regulira silo, tako da je napaka med izmerjeno silo in pridobljeno čim manjša. Glavni program je obsežen, njegovo izvajanje pa je časovno zahtevno, kar predstavlja prvo ozko grlo hitrosti izvajanja. Zagotavljati mora pošiljanje podatkov na nekaj milisekund. Rešitev, ki omogoča hitrostno pošiljanje podatkov, je virtualni spomin. Ta deluje tako, da ima simulacijska igra dodeljeni prostor na RAM pomnilniku, ki nam je dostopen. Glavna prednost tega je, da se nahaja na samem pomnilniku in druga, da je velikost virtualne datoteke, do katere dostopamo, velikokrat manjša od celotnega spomina simulacijske igre. Drugo ozko grlo hitrosti izvajanja pa predstavlja program na Netduinu, ki je zadolžen hkrati za merjenje vseh sil med uporabnikom in vodili ter za regulacijsko zanko. Natančnost meritev je zaradi šuma analogno digitalnega pretvornika povezana s hitrostjo. Hitrost same regulacijske zanke ne predstavlja velike težave, zato smo se osredotočili na hitrost merjenja sile. Zaradi šuma smo vzeli povprečje stotih meritev, pri čemer smo v vsakem krogu regulacijske zanke smo prepisali najstarejšo z novo. Ta algoritem je omogočil, da pridobimo tako želeno hitrost, kot tudi natančnost. Primerjava našega načina simuliranja občutka vožnje in klasičnega, ki je predstavljena v zadnjem poglavju, jasno prikazuje prednosti prvega. Poglavitni prednosti sta, da naš simulator nima omejitev teže uporabnika in je zmožen generirati občutek pospeška tudi do 6G. V fazi razvoja smo zgradili prototip, ki nam je omogočil temeljito razviti idejo. Odzivi testnih uporabnikov so bili zelo pozitivni in so v veliki meri pripomogli k nadaljnjemu razvoju. This thesis presents a new method of simulating the sensation of driving. There are many different driving simulators currently on the market. All of which use the force of gravity to simulate the sensation of driving, which limits their capabilities (especially in regard to simulating long-term forces). Our method works on the principle of generating forces to the head of the user, using actuators. The first part gives a quick overview of the history and development of motion simulators. There have been numerous developments throughout the last decades, but the major issues persist. The new method of simulating the sensation of driving faces its own challenges. The new method of simulating the sensation of driving generates the same forces on the head of the user as he would experience driving an actual vehicle. The simulator, as the thesis, is composed of several units that work together as a whole. The first unit outlines the possible actuators for generating force. The choice of the actuator has a major impact on the choice of the open- or closed-loop controller. The simulation shows that, in the case we choose a DC motor, best results are obtained if controlling the force by measuring it directly. For this purpose we will have a look at the method for measuring the forces generated between the guides and the user. To generate any kind of force we need a power supply. The chosen DC motor requires a high power supply, which has an immense impact on the cost. Therefore we have decided to use two computer power supply units, which together produce a voltage of 24V, to control our actuator. The last and most important part is the software which consists of two programs. The main program is entwined with the simulation game its purpose is to send information from the simulation to the controller Netduino within the shortest time possible. The program on Netduino receives the data and, by means of measuring the force between the user and the guide, controls it appropriately so that the error between the measured and the obtained force is minimized. The main program is the first bottleneck of the time complexity, it has to ensure data transfer every few milliseconds. This can be achieved by using the principle of memory-mapped files. The simulation game gets free access to an allotted space on the RAM. This gives us the advantage of having the file we are accessing handy, the size of which is many times smaller than the whole memory of the simulation game. The second bottleneck is the program on Netduino, which is responsible for measuring all the forces acting between the user and guides, and for controlling the loop. Because of the noise of the analogue-digital converter, the accuracy of the measurement correlates to its speed. The speed of the loop control does not pose a problem, therefore we focused our attention on improving the measuring speed. Because of the noise, we had to use the average of hundred measurements. At the beginning of each loop we replaced the oldest result with the new one. With this algorithm we were able to achieve the desired speed as well as accuracy. The comparison of our driving simulator to the classical type, contained in the last part of the thesis, shows that the former has many advantages, not the least of which are no maximum user weight and the capability of generating long term forces of up to 6G. In the course of the development we constructed a prototype to help us thoroughly explore the idea. Test users provided us with a lot of positive and constructive criticism to aid us on the path of further refinement and development of the product.
- Published
- 2015
45. Načrtovanje in izdelava prilagoditvenega vezja za vodenje laboratorijskih naprav z mikrokrmilnikom
- Author
-
VODOPIJA, DEJAN and Klančar, Gregor
- Subjects
EAGLE ,Arduino UNO ,H-mostič ,LT SPICE ,H-bridge ,krmiljenje ,PWM ,regulation ,regulacija ,controlling ,operacijski ojačevalnik ,operational amplifier - Abstract
Izhodišče za pripravo diplomskega dela predstavljata načrtovanje in izdelava prilagoditvenega vezja za krmiljenje oziroma regulacijo laboratorijskih naprav prek mikrokrmilniške tiskanine Arduino Uno oziroma katerekoli naprave, zmožne oddajanja t. i. pulzno širinskega modeliranega signala (angl. pulse-width modulation). Razloženo bo, kako je mogoče s pomočjo osnovnega teoretičnega znanja o električnih elementih (kot so na primer operacijski ojačevalnik, tranzistor, dioda, kondenzator, upori itd.) sestaviti delujočo shemo oziroma električno vezje za zgoraj omenjeni namen. Opisan bo celoten postopek od idejne zasnove do praktične izdelave naprave. Prve zamisli bodo najprej simulirane v računalniškem okolju, sledilo pa bo dejansko testiranje na preizkusni ploščici ali t. i. protoboardu. Dosegu optimalnega delovanja na protoboardu sledi načrtovanje vezja v namenskem računalniškem programu, kjer moramo biti pazljivi na položaj posameznih elementov glede na njihovo praktično uporabo in morebiten medsebojni vpliv. Sledijo izdelava vezij s pomočjo t. i. fotopostopka ter končna postavitev in montaža v ohišje z vsemi pripadajočimi sponkami, stikali in gumbi. The basis for the preparation of the thesis represent the planning and production of the adaptive circuit for controlling or regulation of laboratory devices through the Arduino Uno microcontroller board or any other device, capable to transmit a so called Pulse-width modulation signal (PWM). Explained will be how it is possible to assemble a working scheme or electric circuit with the help of basic theoretical knowledge on electrical elements (e.g. operational amplifier, transistor, diode, capacitor, resistance etc.) for the stated purpose. Describer will be the entire process from the idea to the practical manufacture of the device. The initial ideas will be simulated in the computer environment, followed by actual testing on the protoboard. Reaching of the optimal functioning on the protoboard will be followed by planning of the circuit in proper software, where we must take care of the position of individual elements regarding their practical use and mutual influence. This is followed by the manufacture of circuits with the help of the photoprocedure the final placement and assembly into the housing with all the with all the associated clips, switches and buttons.
- Published
- 2015
46. Programski modul za optimizacijo vodenja ogrevanja v primeru izpadov temperaturnih senzorjev
- Author
-
NIKOLOVSKI, STEFAN and Klančar, Gregor
- Subjects
sensor fault ,HVAC system ,temperature model ,vodenje na osnovi razmerja izvršnih členov ,HVAC sistemi ,temperaturni model ,actuators ratios based control ,izpad senzorja - Abstract
Zmanjševanje porabe energije spada med najbolj pereče globalne izzive današnjega časa. Za ogrevanje zgradb se porabi približno 40 % svetovne proizvodnje energije. Med največje porabnike energije v zgradbah spadajo sistemi za ogrevanje, prezračevanje in klimatizacijo (angl. Heating, Ventilation and Air Conditioning, HVAC). Za varčno porabo energije je tako potrebno zagotoviti zanesljivo delovanje HVAC sistema. Pri načrtovanju vodenja HVAC sistemov je treba upoštevati, da se lahko vsak sestavni del opreme pokvari. Izpadi posameznih elementov lahko povečajo porabo energije, skrajšajo življenjsko dobo ostale opreme in praviloma zmanjšajo bivalno udobje. Izpad posameznih merilno-regulacijskih členov v sistemu, pri vodenju temperature, povzroči neželene spremembe v celotni regulacijski zanki, saj regulator ne dobi pravilen odčitek senzorja. Ob izpadu merilnega člena v nekem prostoru je običajna praksa, da ''zamrznemo'' izhod iz ustreznega regulatorja. Le-to pa ni vedno najbolj ustrezna rešitev, ker lahko s tem povzročimo znatna odstopanja temperature v prostoru. Problem, ki smo ga obravnavali v diplomskem delu, je razviti in testirati algoritem, ki bo uspešno nadomestil izpadli merilni člen. Omenjen algoritem mora biti enostaven in primeren za implementacijo v praksi. V diplomskem delu je predlagan inovativni koncept za določanje odprtosti izvršnega člena ob izpadu senzorja. Temelji na ugotovitvi, da so odprtosti ventilov v sosednjih prostorih in dejavniki, ki vplivajo na temperaturo posameznih prostorov, medsebojno korelirani. Zato vpeljemo nove funkcije, ki odražajo medsebojna razmerja odprtosti ventilov sosednjih prostorov. Pri izpadu določenega senzorja, predlagani sistem vklopi regulacijsko strukturo za vodenje temperature na osnovi izračunanih funkcij razmerij odprtosti ventilov. Algoritem smo preiskusili na simulacijskem modelu prostora, zgrajenem v programskem okolju MATLAB/Simulink. Za potrebe simulacije smo uporabili realne vremenske podatke za mesto Ljubljana za obdobje enega leta, s frekvenco vzorčenja ene ure. Rezultati so pokazali veliko ujemanje med sistemom brez izpadov in sistemom z odpovedjo enega merilnega člena ob uporabi predlaganega algoritma. Glede na relativno enostavnost in robustnost algoritma ga lahko vgradimo tudi v sistemih vodenja z nezahtevno procesorsko močjo. Reducing energy demand and consumption in residential buildings is a global challenge. Heating of buildings consums nearly 40 % of global energy production. The largest energy consumers in buildings are the Heating, Ventilation and Air Conditioning (HVAC) systems. For reducing energy consumption, reliable control of HVAC systems is required. When designing HVAC control systems, one should take into consideration a possibile sensor failure. Fault of any component in the control loop can increase the energy consumption, shorten lifespan of the rest of the equipment and usually degrade the living comfort. Single fault of the measurement and control component in the temperature control system leads to unwanted changes in the overall control loop, since controller does not receive accurate sensor data. A general practice during the sensor failure is to ''freeze'' the appropriate controller output. Usually, this is not the most appropriate solution, since it can cause larger temperature deviations in a particular room where sensor failure occurs. The scope of the problem presented is to develop and evaluate fault-tolerant algorithm. Developed algorithm should be simple and suitable for implementaion in practice. In this thesis, an innovative concept is proposed for maintaining high control performance when sensor failure occurs. It is based on the findings that valves openings and indoor temperatures are correlated. Therefore, we introduce the new functions which reflect interacting ratios of the valves openings in adjacent rooms. When sensor failure occurs, the proposed system claculates the control signal from the valve openings of the adjacent rooms. We evaluated the algorithm on simulation-based experiment of building model, developed in MATLAB/Simulink programming environment. In the simulations we used real-world weather data for the city of Ljubljana, for a period of one year, with a sampling rate of one hour. It was shown high correlation between the fault-free system and the system with a single sensor fault while using the proposed algorithm. Since the algorithm is relatively simple and robust, it could be implemented in practice in a control systems with low processing power.
- Published
- 2015
47. Inteligentni sistem za avtomatizacijo in nadzor zunanjih motoriziranih žaluzij
- Author
-
METELKO, MATIC and Klančar, Gregor
- Subjects
zunanje žaluzije ,Avtomatsko senčenje ,sledenje soncu ,WebSocket ,Arduino ,external venetian blinds ,sun tracking ,energijska učinkovitost ,Automatic shading ,energy efficiency - Abstract
Zaradi uporabnikovega neustreznega upravljanja z okenskimi senčili se ne izkorišča potencialni prihranek energije ter se sočasno ustvarja neugoden vpliv na udobje stanovalcev. Zaradi omenjenega je bil namen diplomskega dela izdelava avtomatskega senčnega sistema, ki optimizira dnevne vremenske razmere za zagotavljanje učinkovite izrabe energije in prijetnega bivalnega ambienta. Zaradi specifičnih situacij je bil dodaten namen omogočiti ročno upravljanje in prednastavljivo upravljanje s časovno uro. Sočasno je bil namen omogočiti centraliziran in oddaljen dostop za upravljanje, nadzorovanje in konfiguriranje celotne aplikacije. Diplomska naloga opisuje razvoj samostojnega sistema za avtomatsko senčenje, ki kot senčni element uporablja zunanje motorizirane žaluzije. Sistem se prilagaja dnevnim vremenskim razmeram za učinkovito izrabe energije in preprečevanje neprijetnega bleščanja ob nizkem položaju sonca. Predstavljeni so sklopi, ki zajemajo metodo avtomatskega pomikanja žaluzij, izgradnjo modela žaluzij in določanje optimalnega položaja žaluzij, glede na podatke senzorjev temperatur, senzorja svetlobe, položaja sonca in orientacij oken. Drugi sklop dela predstavlja izdelavo spletnega uporabniškega vmesnika, ki omogoča oddaljen dostop za upravljanje, nadzor in konfiguracijo avtomatskega senčnega sistema. Prikazana je komunikacija med krmilnikom in spletnim brskalnikom, ki z uporabo tehnologije WebSocket deluje v realnem času. Celoten sistem avtomatskega senčenja in strežnik, ki realizira oddaljen dostop bazira na mikrokrmilniku Arduino. Zaradi funkcionalnih zahtev aplikacije, je bilo potrebno izvesti ustrezno hranjenje časa in uporabniških podatkov. Delovanje sistema bo potrebno še dodatno preveriti na realnih aplikacijah in po potrebi prilagoditi nekatere parametre, ki so bili nastavljeni na podlagi simulacij. There is a loss of potential energy savings and negative impact on occupants comfort due to the user’s improper operation of windows shades. Therefore the purpose of the thesis was to develop an automatic shading system that optimizes daily weather conditions to meet the needs of energy efficiency and comfortable ambient conditions. Due to some specific situations the aim was also to support manual control and programmable time switch control. Additionally the purpose was to enable centralized remote access to control, monitor and configure the entire system. The thesis describes the development of an automatic shading system that uses motorized external venetian blinds as a shading device. The system is adjusting itself based on daily weather conditions to achieve the desired energy efficiency and to prevent uncomfortable glare when the sun is low. Presented work describes a method for automated movement of blinds, procedure of building a blind model and logics for determining the optimal shade angle that is based on data from temperature sensors, light sensor, calculated sun position, and windows orientation. In the second part of the thesis the development of user interface is presented, which enables remote access for controlling, monitoring and configuring the automatic shading system. Presented communication between the controller and web browser is running in real-time with the use of WebSocket technology. The automatic shading system and the server enabling the remote access is entirely implemented on the Arduino microcontroller. Because of functional requirements the proper storing of time and user data had to be implemented. The system operation should be further verified on real applications and some parameters, which were set based on simulations, should be adapted if necessary.
- Published
- 2015
48. Simulacija trajektorij vesoljskih plovil
- Author
-
MARKOVČIČ, ANDREJ and Klančar, Gregor
- Subjects
open source tools ,vizualizacija ,trajectory ,tirnica ,satellite ,open source software libraries ,satelit ,odprtokodne programske knjižnice ,odprtokodna orodja ,simulation ,simulacija ,visualization - Abstract
Kljub razvoju cenovno dostopnejših tehnologij izdelave in izstrelitve satelitov pa so stroški tovrstnih projektov še vedno visoki, tako pri strojni in programski komponenti satelita kot tudi podporni infrastrukturi za upravljanje z njim. Stroškom strojne komponente satelita in infrastrukture se ne da izogniti, razen na račun večjih tveganj za neuspešno izveden projekt, slabšo kakovost oz. okrnjeno izvedbo rešitve. Na drugi strani pa digitalna doba s svojim razvojem in dostopnostjo preko medmrežja ponuja možnosti za znižanje stroškov izdelave programske komponente vsaj določenih podsistemov oz. podporne infrastrukture. Naloga mojega diplomskega dela je torej raziskati možnosti za načrtanje programa za izračun trajektorije vesoljskega plovila z uporabo izključno odprtokodnih programskih orodij in programskih knjižnic, kot tudi praktična izvedba opisanega programa. Naloga programa je računanje stanj vesoljskega plovila v prihodnosti, iz podanih informacij o začetnem stanju, z uporabo r Despite the decreasing costs of satellite development and launch technologies, the expenditure of such projects is still high. This includes the hardware and software components of a satellite as well as the supporting infrastructure needed to operate it. The costs of hardware component cannot be avoided without inducing higher risks of an unsuccessful project, decreased quality or removing some of the components. However, the digital age, through its progress and Internet accessibility, provides us with possibilities of reducing costs for software development for at least some of the subsystems or supporting infrastructure. This thesis deals with researching the possibilities of developing a program that computes the future satellite positions by using exclusively open source tools and software libraries. It shall also result in its implementation. The task of the program is computing future states of the spacecraft based on the input initial state by using different computational
- Published
- 2014
49. Razvoj algoritma za sledenje točki maksimalne moči sončnih celic in primerjava sprejemnikov sončne energije
- Author
-
MAVER, MATEJ and Klančar, Gregor
- Subjects
solar collectors ,photovoltaic modules ,sončna energija ,solar power ,sončni kolektorji ,električni sončni moduli ,MPP-algorithms ,ogrevanje vode ,MPP-regulator ,energija ,water heating ,energy - Abstract
Predstavljen je razvoj sistema za ogrevanje sanitarne vode s sončnimi moduli. Predstavljeni so uveljavljeni sistemi za solarno ogrevanje sanitarne vode. Električni sončni moduli se večinoma uporabljajo za sončne elektrarne. Zaradi vedno nižje cene električnih sončnih modulov in nekaterih prednosti, ki jih imajo moduli pred kolektorji, pa postajajo zanimivi tudi za ogrevanje vode. V delu bo obravnavana razlika med obema sistemoma s podanimi prednostmi in slabostmi enega in drugega. Obravnavana bo tudi smiselnost uporabe električnih sončnih modulov tam, kjer že obstaja električno omrežje. Za višji izkoristek električnih sončnih modulov je bil razvit regulator, ki s posebnim algoritmom vzdržuje razmerje med napetostjo in tokom na panelih tako, da proizvajajo maksimalno moč. Hkrati je regulator prilagojen gretju vode v klasičnem rezervoarju vode za hišne potrebe, kar zniža stroške razvoja in izdelave. Za popolnoma samostojno delovanje sistema je bil dodan programirljiv logični krmilnik. The thesis describes development and implementation of domestic water heating system using photovoltaic modules. The standard widely used flat plate solar collectors are presented alongside so that the new system can be compared and evaluated. One reason for developing this new system otherwise mostly used for solar power plants is the recent price drop of photovoltaic modules. The other reasons are many advantages that photovoltaic modules offer over solar collectors. This thesis will compare old and well known system with solar collectors and newly developed system with photovoltaic modules. For achieving a higher efficiency of solar cells an improvement on existing algorithm was made. A special controller for the system was designed to replace expensive inverters so that the cost of the complete system can be reduced to minimum. The thesis covers this aspect and accesses whether the photovoltaic industry is a net electricity producer or a consumer.
- Published
- 2014
Catalog
Discovery Service for Jio Institute Digital Library
For full access to our library's resources, please sign in.