An open API service providing repository metadata for many open source software ecosystems.

Topic: "stepper-motor-control"

simplefoc/Arduino-FOC

Arduino FOC for BLDC and Stepper motors - Arduino Based Field Oriented Control Algorithm Library

Language: C++ - Size: 10.2 MB - Last synced at: 7 days ago - Pushed at: about 1 month ago - Stars: 2,272 - Forks: 578

laurb9/StepperDriver

Arduino library for A4988, DRV8825, DRV8834, DRV8880 and generic two-pin (DIR/STEP) stepper motor drivers

Language: C++ - Size: 192 KB - Last synced at: 8 months ago - Pushed at: 8 months ago - Stars: 542 - Forks: 231

signag/raspi-cam-srv

Web Server for Raspi Camera Access and control of GPIO-devices

Language: Python - Size: 54 MB - Last synced at: 12 days ago - Pushed at: 12 days ago - Stars: 118 - Forks: 14

dukelec/cdstep

Stepper Motor Controller

Language: C - Size: 4.48 MB - Last synced at: 29 days ago - Pushed at: 29 days ago - Stars: 49 - Forks: 26

filipmu/Marlin-Mackerel

Mackerel - A Version of Marlin for Lyman Extruders

Language: C - Size: 2.65 MB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 38 - Forks: 24

khoih-prog/RP2040_PWM 📦

This library enables you to use Hardware-based PWM channels on RP2040-based boards, such as Nano_RP2040_Connect, RASPBERRY_PI_PICO, with either Arduino-mbed (mbed_nano or mbed_rp2040) or arduino-pico core to create and output PWM any GPIO pin. The most important feature is they're purely hardware-based PWM channels, supporting very high PWM frequencies. Therefore, their executions are not blocked by bad-behaving functions or tasks. This important feature is absolutely necessary for mission-critical tasks. These hardware-based PWMs, still work even if other software functions are blocking. Moreover, they are much more precise (certainly depending on clock frequency accuracy) than other software-based PWM using ISR, millis() or micros(). That's necessary if you need to control devices requiring high precision. New efficient setPWM_manual function to facilitate waveform creation using PWM

Language: C++ - Size: 206 KB - Last synced at: almost 2 years ago - Pushed at: about 2 years ago - Stars: 38 - Forks: 9

ftjuh/I2Cwrapper

I2Cwrapper is a firmware framework which helps you implement Arduino based I2C target (slave) devices for control of non-I2C hardware. Supports plain Arduinos, ESP8266, ESP32, SAMD, STM32, and ATtiny platforms.

Language: C++ - Size: 4.65 MB - Last synced at: 5 months ago - Pushed at: about 2 years ago - Stars: 27 - Forks: 4

yasir-shahzad/SmartSine-Stepper

SmartSine Stepper is an STM32F103RBT6-based PID stepper driver, an upgraded variant of Stepper Nano Zero. It offers low vibrations, reduced noise, and adaptive current control based on torque and load conditions.

Size: 2.77 MB - Last synced at: 24 days ago - Pushed at: 4 months ago - Stars: 25 - Forks: 1

juanmf/StepperMotors

Python stepper motor library with customizable acceleration strategies and responsive, interruptible motor operations.

Language: Python - Size: 2.69 MB - Last synced at: 27 days ago - Pushed at: about 1 year ago - Stars: 23 - Forks: 0

goodrobotics/wifistepper

Wi-Fi Stepper project repo

Language: HTML - Size: 5.5 MB - Last synced at: about 2 years ago - Pushed at: over 3 years ago - Stars: 22 - Forks: 5

eldendiss/DendoStepper

Stepper motor API for esp-idf.

Language: C++ - Size: 87.9 KB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 18 - Forks: 4

sq7bti/iAccelStepper

interrupt driven stepper controller inherited from AccelStepper

Language: C++ - Size: 23.4 KB - Last synced at: 5 months ago - Pushed at: almost 6 years ago - Stars: 14 - Forks: 6

AutoRoboCulture/arduino-jetson-nano-stepper-motor-interface

Control Arduino uno/mega/nano with Jetson nano linux command line

Language: C++ - Size: 114 KB - Last synced at: over 1 year ago - Pushed at: over 5 years ago - Stars: 13 - Forks: 3

JulNadeauCA/FabBSD

Unix-like operating system for CNC / Machine Control applications

Language: C - Size: 92 MB - Last synced at: 12 months ago - Pushed at: almost 7 years ago - Stars: 10 - Forks: 5

stephenkingston/multi-axis-stepper-driver

STM32F103C8T6 driver software for multi-axis co-ordinated motion control of multiple stepper motors.

Language: C++ - Size: 16.4 MB - Last synced at: almost 2 years ago - Pushed at: about 4 years ago - Stars: 7 - Forks: 4

khoih-prog/ESP32_FastPWM 📦

This library, a wrapper around ESP32 ledc library, enables you to use Hardware-based PWM channels on ESP32, ESP32_S2, ESP32_S3 or ESP32_C3-based boards to create and output PWM to pins. Using similar functions as some other FastPWM libraries, it enables you to port PWM code easily between platforms.

Language: C++ - Size: 185 KB - Last synced at: about 2 years ago - Pushed at: about 2 years ago - Stars: 6 - Forks: 0

khoih-prog/AVR_PWM 📦

This library enables you to use Hardware-based PWM channels on AVR-based boards, such as Nano, UNO, Mega, Leonardo, 32u4, etc., to create and output PWM. Using the same functions as other FastPWM libraries to enable you to port PWM code easily between platforms.

Language: C++ - Size: 117 KB - Last synced at: about 2 years ago - Pushed at: about 2 years ago - Stars: 5 - Forks: 0

Jana-Marie/OtterStepMini

OtterStepMini is a user friendly, up to 48V 10A stepper-motor-driver with USB-CDC and USB-PD for desktop-applications.

Size: 1.87 MB - Last synced at: about 2 months ago - Pushed at: over 3 years ago - Stars: 5 - Forks: 0

simplefoc/Arduino-FOC-minimal-project-builder

A minimal project builder for the simplefoc library.

Language: C++ - Size: 3.88 MB - Last synced at: 18 days ago - Pushed at: over 3 years ago - Stars: 5 - Forks: 5

Peter-T-Ruehr/PiScAnt

Python code to run scAnt 3D scanning setup on a Raspberry Pi

Language: Python - Size: 220 KB - Last synced at: 13 days ago - Pushed at: 5 months ago - Stars: 4 - Forks: 0

khoih-prog/STM32_PWM 📦

This wrapper library enables you to use Hardware-based PWM on STM32F/L/H/G/WB/MP1 boards to create and output PWM to pins. The most important feature is they're purely hardware-based PWM channels. Therefore, their executions are very precise and not blocked by bad-behaving functions or tasks. This important feature is absolutely necessary for mission-critical tasks. These hardware PWM channels still work even if other functions are blocking. Moreover, they are much more precise (certainly depending on clock frequency accuracy) than other ISR-based or software-based PWM using millis() or micros(). That's necessary if you need to measure some data requiring very high frequency and much better accuracy. PWM feature can now be used.

Language: C - Size: 132 KB - Last synced at: about 2 years ago - Pushed at: about 2 years ago - Stars: 4 - Forks: 1

jproj3cts/Manual-to-Motorized-Linear-Translation-Stage-Upgrade-Kit

The cheapest possible design for upgrading a manual linear translation stage to an automatic one, whilst retaining the original precision of the device.

Language: Python - Size: 4 MB - Last synced at: 10 months ago - Pushed at: 10 months ago - Stars: 3 - Forks: 0

khoih-prog/MBED_RP2040_PWM 📦

This library enables you to use Hardware Timers on RP2040-based RP2040 board to create and output PWM to pins. These PWM channels, using RP2040 Hardware-PWM channels, still work even if other functions are blocking. Moreover, they are much more precise (certainly depending on clock frequency accuracy) than other software ISR-based PWM, using millis(), micros() or Timer Interrupt. This important feature is absolutely necessary for mission-critical tasks. You can start, stop, change and restore the settings of any PWM channel on-the-fly

Language: C - Size: 48.8 KB - Last synced at: about 2 years ago - Pushed at: about 2 years ago - Stars: 3 - Forks: 1

OpenMYR/ESP32-Stepper

OpenMYR ESP32 controller board, stepper driver with A5984

Size: 334 KB - Last synced at: over 1 year ago - Pushed at: almost 4 years ago - Stars: 3 - Forks: 1

giridharanponnuvel/Python-Arduino_StepperMotorControl

This code is developed to control 3 stepper motor simultaneously in a delta robot. This code receive a string from the python using serial communication. The python will send a string like this 52a34b67c? where 52 is the number of steps to be turned by Motor A, 34 is the no.of steps to be turned by Motor B. Similarly, 67 for Motor C. After Arduino receiving the string, it will process it and send signal to the 3 stepper motor drivers.

Language: C++ - Size: 6.84 KB - Last synced at: over 1 year ago - Pushed at: over 5 years ago - Stars: 3 - Forks: 0

gavinlyonsrepo/Stepper_Motor_Control_PICO

Library to control Stepper Motors , Raspberry pi PICO SDK C++

Language: C++ - Size: 101 KB - Last synced at: 12 days ago - Pushed at: 2 months ago - Stars: 2 - Forks: 0

Wauro21/SMCD

The Arduino driver of the SMC project! Allows for easy control of a Stepper Motor using the Pololu Driver Board.

Language: C++ - Size: 477 KB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 2 - Forks: 0

patrick-nelissen/PiPicoStepperModule

Stepper Motor Controller with RS485 interface and AllMotion style interface

Language: Python - Size: 14.8 MB - Last synced at: almost 2 years ago - Pushed at: about 2 years ago - Stars: 2 - Forks: 2

khoih-prog/ATtiny_PWM 📦

This library enables you to use Hardware-based PWM channels on Arduino AVR ATtiny-based boards (ATtiny3217, etc.), using megaTinyCore, to create and output PWM to pins. Using the same functions as other FastPWM libraries to enable you to port PWM code easily between platforms

Language: C++ - Size: 352 KB - Last synced at: about 2 years ago - Pushed at: about 2 years ago - Stars: 2 - Forks: 1

khoih-prog/Portenta_H7_PWM 📦

This library enables you to use Hardware Timers on an STM32H7-based Portenta_H7 board to create and output PWM to pins. These PWM channels, using Portenta_H7 Hardware Timers, still work even if other functions are blocking. Moreover, they are much more precise (certainly depending on clock frequency accuracy) than other software or ISR-based PWM, using millis(), micros() or Timer Interrupt. This important feature is absolutely necessary for mission-critical tasks. You can start, stop, change and restore the settings of any PWM channel on-the-fly.

Language: C - Size: 134 KB - Last synced at: about 2 years ago - Pushed at: about 2 years ago - Stars: 2 - Forks: 0

khoih-prog/ContinuousStepper_Generic 📦

This library enables you to use Hardware-based PWM channels on Generic boards to use PWM to control continuous Stepper Motor. The most important feature is they're purely hardware-based PWM channels, supporting very high PWM frequencies. Therefore, their executions are not blocked by bad-behaving functions or tasks

Language: C - Size: 45.9 KB - Last synced at: about 2 years ago - Pushed at: about 2 years ago - Stars: 2 - Forks: 0

leonardin999/4-DOF-Controller-with-Stepper-Motor

4-DOF robot, Arduino, Kinematics, C#, Stepper Motor, Solidwork, etc.

Language: MATLAB - Size: 89.7 MB - Last synced at: over 1 year ago - Pushed at: over 3 years ago - Stars: 2 - Forks: 0

florian-lapp/tmcm-lib-py

TMCM-Lib – Trinamic Motion Control Module Library for Python

Language: Python - Size: 87.9 KB - Last synced at: about 1 month ago - Pushed at: almost 4 years ago - Stars: 2 - Forks: 0

gerritonagoodday/spiderrobot

This is a prototype 8-legged spider with 2 pincers, 2 cameras for eyes, moving vision, and a mandible with pointy teeth to scare the little children, all made mode LEGO Technic. The MCU is an ESP32 Dev module, and software is written in C++.

Language: C - Size: 1.11 GB - Last synced at: almost 2 years ago - Pushed at: over 4 years ago - Stars: 2 - Forks: 1

aazuspan/ArduinoLatheController

An Arduino-based stepper motor control with servo speed adjustment to run a lathe leadscrew

Language: C++ - Size: 35.2 KB - Last synced at: about 1 month ago - Pushed at: over 5 years ago - Stars: 2 - Forks: 0

JakesMD/ExcelStepper

An excellent Arduino library for stepper motor control, offering simplicity, speed, and precise acceleration for smooth movement.

Language: C++ - Size: 176 KB - Last synced at: about 2 months ago - Pushed at: 5 months ago - Stars: 1 - Forks: 0

gsunea/28BYJ-48-Stepper-motor-control

3 different stepper motor controlling methods implemented in Arduino.

Language: C++ - Size: 4.88 KB - Last synced at: 12 months ago - Pushed at: 12 months ago - Stars: 1 - Forks: 0

Wauro21/SMCC

SMCC (SMC_core) allows for direct communication and control of the Serial-Motor-Controller project via Python-code.

Language: Python - Size: 145 KB - Last synced at: 5 months ago - Pushed at: over 1 year ago - Stars: 1 - Forks: 0

khoih-prog/SAMD_PWM 📦

This library enables you to use Hardware-based PWM channels on SAMD21/SAMD51-based boards to create and output PWM to pins. Using the same functions as other FastPWM libraries to enable you to port PWM code easily between platforms.

Language: C++ - Size: 97.7 KB - Last synced at: about 2 years ago - Pushed at: about 2 years ago - Stars: 1 - Forks: 0

khoih-prog/nRF52_PWM 📦

This library enables you to use Hardware-based PWM channels on nRF52-based boards to create and output PWM to pins. Using the same functions as other FastPWM libraries to enable you to port PWM code easily between platforms.

Language: C++ - Size: 92.8 KB - Last synced at: about 2 years ago - Pushed at: about 2 years ago - Stars: 1 - Forks: 0

khoih-prog/megaAVR_PWM 📦

This library enables you to use Hardware-based PWM channels on megaAVR-based boards, such as UNO WiFi Rev2, AVR_Nano_Every, etc., to create and output PWM. Using the same functions as other FastPWM libraries to enable you to port PWM code easily between platforms.

Language: C++ - Size: 53.7 KB - Last synced at: about 2 years ago - Pushed at: about 2 years ago - Stars: 1 - Forks: 1

ardiloot/PyUSMC

This is a wrapper module to use Standa 8SMC1-USBhF stepper motor controllers from Python. The module requires C/C++ developement package (MicroSMC) to be installed and USMCDLL.dll in path.

Language: Python - Size: 14.6 KB - Last synced at: 12 months ago - Pushed at: over 2 years ago - Stars: 1 - Forks: 4

PS-3D/nanotec-stepper-driver

Rust library to communicate with Nanotec stepper-motor controllers

Language: Rust - Size: 241 KB - Last synced at: about 2 years ago - Pushed at: over 2 years ago - Stars: 1 - Forks: 0

makerportal/nema17-python

Python codes for controlling a NEMA 17 stepper motor

Language: Python - Size: 15.6 KB - Last synced at: about 2 years ago - Pushed at: almost 4 years ago - Stars: 1 - Forks: 1

KushagraK7/ButtonAccelStepper

Arduino code to control a stepper motor's movement using pushbuttons with the help of the AccelStepper library.

Language: C++ - Size: 1000 Bytes - Last synced at: over 1 year ago - Pushed at: almost 4 years ago - Stars: 1 - Forks: 0

tspspi/DualDRV8825DrvStepperBoard

Controller board to use two steppers via DRV8825 drivers and provide accelerated / decelerated movement, constant speed mode, etc. via an I2C command channel

Language: C - Size: 313 KB - Last synced at: about 2 years ago - Pushed at: over 4 years ago - Stars: 1 - Forks: 1

fwacer/conveyor-sorting-machine

The system uses a reflectivity sensor to sort 4 different types of objects into categories: black plastic, white plastic, steel, and aluminum.

Language: C - Size: 10.4 MB - Last synced at: about 1 year ago - Pushed at: about 5 years ago - Stars: 1 - Forks: 0

echicken/A4988

Use an A4988 stepper motor controller on a Raspberry Pi with node.js

Language: JavaScript - Size: 20.5 KB - Last synced at: over 1 year ago - Pushed at: over 5 years ago - Stars: 1 - Forks: 4

TomLXXVI/pyberryplc

PLC programming on Raspberry Pi with Python

Language: Python - Size: 115 KB - Last synced at: 4 days ago - Pushed at: 4 days ago - Stars: 0 - Forks: 0

inhald/asip_stepper_motor

8-bit RISC ASIP for Stepper Motor Controller with both full and half step capabilities. Implemented in Verilog HDL.

Language: Verilog - Size: 10 MB - Last synced at: 15 days ago - Pushed at: 15 days ago - Stars: 0 - Forks: 0

papsdroidfr/Stepper16bitsControl

Carte de commande parrallèle 16bits pour 8 moteurs pas à pas

Language: Python - Size: 585 KB - Last synced at: about 1 month ago - Pushed at: about 1 month ago - Stars: 0 - Forks: 0

codewithzahid/TwoWireStepper

Standalone mode operation compatible with TB6600, A4988, TMC2209, DRV8825, and other stepper motor drivers.

Language: C++ - Size: 1000 Bytes - Last synced at: about 2 months ago - Pushed at: about 2 months ago - Stars: 0 - Forks: 0

alnau/mixer_proj_rev2_u8g2_cleared_up_memOpt_v2_neueFlow

Программа для микроконтроллера, используемого при выращивании монокристаллов по методу Чохральского

Language: C++ - Size: 657 KB - Last synced at: 3 months ago - Pushed at: 3 months ago - Stars: 0 - Forks: 0

prvashisht/Stepper_Motor

Arduino library to control a stepper motor with A4988 stepper motor controller.

Language: C++ - Size: 4.88 KB - Last synced at: 10 months ago - Pushed at: 10 months ago - Stars: 0 - Forks: 0

mlab-modules/HBSTEP01

Stepper motor driver

Language: Processing - Size: 17.3 MB - Last synced at: 11 months ago - Pushed at: 11 months ago - Stars: 0 - Forks: 0

anachrocomputer/Stepper28BYJ

Some Arduino sketches for driving 28BYJ geared stepper motors.

Language: C++ - Size: 1.95 KB - Last synced at: 19 days ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 0

sitronlabs/SitronLabs_Trinamic_TMC5130_Arduino_Library

Arduino library for the Trinamic TMC5130 stepper motor driver

Language: C++ - Size: 2.12 MB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 0

Invary/cnc

Size: 29.9 MB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 0 - Forks: 0

MicaelJarniac/LaunchPad-Stepper

A MSP-EXP430G2 LaunchPad firmware to control the BOOST-DRV8711 Stepper Motor BoosterPack through a simplified UART protocol.

Language: C - Size: 248 KB - Last synced at: 5 days ago - Pushed at: over 1 year ago - Stars: 0 - Forks: 1

Emile1154/driver_carotage

НПФ Электро firmware for stepper driver

Language: C++ - Size: 15.6 KB - Last synced at: 2 months ago - Pushed at: over 1 year ago - Stars: 0 - Forks: 0

baranyazici/Omni-Wheel-Robot-Development-for-Industrial-Transportation

Language: C++ - Size: 12.9 MB - Last synced at: almost 2 years ago - Pushed at: almost 2 years ago - Stars: 0 - Forks: 0

Udhul/Trajectory-Planner

Load and execute g-code via a serial connection to the controller

Language: Python - Size: 1000 Bytes - Last synced at: about 2 years ago - Pushed at: about 2 years ago - Stars: 0 - Forks: 0

khoih-prog/Dx_PWM 📦

This library enables you to use Hardware-based PWM channels on Arduino AVRDx-based boards (AVR128Dx, AVR64Dx, AVR32Dx, etc.), using DxCore, to create and output PWM. Using similar functions as many other FastPWM libraries, it enables you to port PWM code easily between platforms.

Language: C++ - Size: 790 KB - Last synced at: about 2 years ago - Pushed at: about 2 years ago - Stars: 0 - Forks: 0

khoih-prog/nRF52_MBED_PWM 📦

This library enables you to use Hardware Timers on nRF52840-based Nano_33_BLE or Nano_33_BLE_Sense board to create and output PWM to pins. These PWM channels, using nRF52840 Hardware Timers, still work even if other functions are blocking. Moreover, they are much more precise (certainly depending on clock frequency accuracy) than other software ir ISR-based PWM, using millis(), micros() or Timer Interrupt. This important feature is absolutely necessary for mission-critical tasks. You can start, stop, change and restore the settings of any PWM channel on-the-fly.

Language: C - Size: 51.8 KB - Last synced at: about 2 years ago - Pushed at: about 2 years ago - Stars: 0 - Forks: 1

khoih-prog/SAMDUE_PWM 📦

This library, a wrapper around SAM DUE analogWrite() function, enables you to use Hardware-based PWM channels on SAM_DUE boards to create and output PWM to pins. Using similar functions as some other FastPWM libraries, it enables you to port PWM code easily between platforms

Language: C++ - Size: 56.6 KB - Last synced at: about 2 years ago - Pushed at: about 2 years ago - Stars: 0 - Forks: 0

khoih-prog/Teensy_PWM 📦

This library enables you to use Hardware-based PWM channels on Teensy boards, such as Teensy 2.x, Teensy LC, Teensy 3.x, Teensy 4.x, Teensy MicroMod, etc., to create and output PWM to pins. Using the same functions as other FastPWM libraries to enable you to port PWM code easily between platforms.

Language: C++ - Size: 68.4 KB - Last synced at: about 2 years ago - Pushed at: about 2 years ago - Stars: 0 - Forks: 0

sergio1990/stepper_rpi

The Ruby gem providing functionality for controlling a stepper motor from the Raspberry Pi

Language: Ruby - Size: 194 KB - Last synced at: about 2 years ago - Pushed at: over 2 years ago - Stars: 0 - Forks: 0

tylerfeldman321/Crane-Game

Crane Game using Custom Pipelined Processor

Language: VHDL - Size: 90.9 MB - Last synced at: about 2 years ago - Pushed at: over 2 years ago - Stars: 0 - Forks: 0

PiotrG1996/gimbal_controller

Language: C - Size: 1.5 MB - Last synced at: about 2 years ago - Pushed at: almost 3 years ago - Stars: 0 - Forks: 0

ThuraTunScibotics/CNC-Cake-Decorating-Machine

4th yr Academic Project of Mechanical Precision and Automation Engineering

Language: C++ - Size: 33 MB - Last synced at: about 1 year ago - Pushed at: about 3 years ago - Stars: 0 - Forks: 0

atlas144/stepper-motor-library

A library that works as a simple interface which makes it easier to work with common stepper motors on the Arduino platform.

Language: C++ - Size: 8.79 KB - Last synced at: over 1 year ago - Pushed at: over 3 years ago - Stars: 0 - Forks: 0

SoamBuild/BaseDisplay

Mesa vibratoria controlable en 2 ejes con el objetivo de utilizarla como sistema de estandarización de sistemas de movimiento para la calibración de los sensores de desplazamiento

Language: C++ - Size: 166 KB - Last synced at: about 2 years ago - Pushed at: almost 4 years ago - Stars: 0 - Forks: 1

Cap-n-Proud/pi_stepper_driver

A stepper motor driver library developed in python for Raspberry Pi

Size: 5.86 KB - Last synced at: about 1 year ago - Pushed at: almost 4 years ago - Stars: 0 - Forks: 0

KushagraK7/WiiNunchukStepperMotor

Arduino code to use a WII Nunchuck to communicate via I2C to an Arduino(or almost any other) microcontroller to control a stepper motor.

Language: C++ - Size: 0 Bytes - Last synced at: over 1 year ago - Pushed at: almost 4 years ago - Stars: 0 - Forks: 0

KuchTo/Stepper_Motor_Control

Schrittmotorsteuerung mit dem Arduino

Language: C++ - Size: 4.54 MB - Last synced at: about 2 years ago - Pushed at: over 4 years ago - Stars: 0 - Forks: 0

adrian-soch/stepper_motor_controller

Using a STM32L476 MCU to control stepper motor speed, direction, and step type.

Language: C - Size: 23.4 KB - Last synced at: about 2 years ago - Pushed at: over 4 years ago - Stars: 0 - Forks: 0

tsonthalia/Light-Alarm

A light-based alarm system that imitates the sunrise in order to assist waking up before the sunrise.

Language: C++ - Size: 2.93 KB - Last synced at: over 1 year ago - Pushed at: about 5 years ago - Stars: 0 - Forks: 0

MicaelJarniac/StepperComms

A Python script for communicating with the LaunchPad Stepper, a MSP-EXP430G2 LaunchPad firmware to control the BOOST-DRV8711 Stepper Motor BoosterPack through a simplified UART protocol.

Language: Python - Size: 11.7 KB - Last synced at: 5 days ago - Pushed at: over 5 years ago - Stars: 0 - Forks: 0

pi2-2019/firmware-mcu-pnp

Firmware and example PCB for MSP430G2553 based Pick and Place machine.

Language: C - Size: 160 KB - Last synced at: about 2 years ago - Pushed at: almost 6 years ago - Stars: 0 - Forks: 0

ujjwalmaity/DamAutomation

It is a group project.

Language: C++ - Size: 1.2 MB - Last synced at: 8 months ago - Pushed at: almost 6 years ago - Stars: 0 - Forks: 0

magnusoy/Arduino-StepperMotor-Library

Arduino library for using bipolar steppermotors.

Language: C++ - Size: 5.86 KB - Last synced at: almost 2 years ago - Pushed at: almost 6 years ago - Stars: 0 - Forks: 0

JamoDevNich/Arduino-MillisStepper

A non-blocking controller for running multiple L298N/L9110S dual h-bridge drivers with a single arduino

Language: C++ - Size: 4.88 KB - Last synced at: almost 2 years ago - Pushed at: almost 6 years ago - Stars: 0 - Forks: 0

avsa242/tmc2130-spin

P8X32A/Propeller driver object for the Trinamic TMC2130 Stepper-motor driver IC

Language: Propeller Spin - Size: 19.5 KB - Last synced at: about 2 years ago - Pushed at: about 6 years ago - Stars: 0 - Forks: 0

NveCorporation/mechatronic-xylophone

See https://youtu.be/Gw_yF0ZjmjA for a demonstrtion

Language: C++ - Size: 3.91 KB - Last synced at: almost 2 years ago - Pushed at: about 6 years ago - Stars: 0 - Forks: 0

javimontero/zenslider-controller

ATMEGA644p firmware for ZenSlider and ZenFocus controller

Language: C++ - Size: 2.69 MB - Last synced at: about 2 years ago - Pushed at: about 6 years ago - Stars: 0 - Forks: 0

mziadawood/ChessRobot

Final Year Project: Chess Robot

Language: Python - Size: 430 KB - Last synced at: about 2 years ago - Pushed at: about 6 years ago - Stars: 0 - Forks: 0

roboter/ESP8266_Timelapse

Slider project with ESP8266 and Display

Language: C++ - Size: 34.6 MB - Last synced at: over 1 year ago - Pushed at: over 6 years ago - Stars: 0 - Forks: 0

juliojoel/atmega328-24lc256

Axis control with Atmel ATmega328 and saved positions in 24LC256 EEPROM.

Language: C - Size: 9 MB - Last synced at: about 2 years ago - Pushed at: almost 7 years ago - Stars: 0 - Forks: 0

Satoshi-Hirazawa/arduino-halfStepper

Language: C++ - Size: 4.88 KB - Last synced at: over 1 year ago - Pushed at: almost 7 years ago - Stars: 0 - Forks: 0