Repository navigation

#

pca9685

Arduino library to enable smooth servo movement.

C++
332
5 个月前

二自由度云台实现人脸追踪。 首先是使用一款名字叫做IP摄像头的APP 采集手机摄像头的图像,在手机上建立一个视频流服务器。在局域网下,PC通过IP还有端口号获取图像。使用OpenCV的人脸检测的API获取人脸在画面中的位置,根据人脸位置距离画面中心的x轴与y轴的偏移量(offset) ,通过P比例控制(PID控制中最简单的一种)控制二自由度云台上臂与下臂的旋转角度,将角度信息通过串口通信UART发送给ESP32单片机(不限于ESP32,STM32,Arduino都可以)解析执行对应的操作,从而使得人脸尽可能处在画面的正中间。

Python
201
7 年前

A differential drive robot is controlled using ROS2 Humble running on a Raspberry Pi 4 (running Ubuntu server 22.04). The vehicle is equipped with a raspberry pi camera for visual feedback and an RPlidar A1 sensor used for Simultaneous Localization and Mapping (SLAM), autonomous navigation and obstacle avoidance.

Python
140
1 个月前

This software is a devLib extension to wiringPi http://wiringpi.com/ and enables it to control the Adafruit PCA9685 16-Channel 12-bit PWM/Servo Driver http://www.adafruit.com/products/815 via I2C interface.

C
64
4 年前

PCA9685 full-featured driver library for general MCU and Linux.

C
63
2 天前

Arduino Uno/Mega2560 MotorDriverBoard

C++
30
6 个月前

Sample ESP32 snippet for 16-Channel 12-bit PWM Driver

C
28
7 年前

Driver for the PCA9685 12-bit PWM driver using STM32Cube HAL

C
26
5 年前

A 6 degree of freedom (DOF) robot arm is controlled using the ROS2 robotic manipulation platform, MoveIt 2. The ROS2 Humble version of MoveIt 2 is used, which runs in a Docker container on an Nvidia Jetson Nano board. The robot arm is equipped with an Intel Realsense D415 depth camera used to detect ArUco markers on objects to be picked up.

Python
23
7 个月前

This is to connect a LED-Lamp (with up to 16 channels and 4096 steps resolution per channel) to a mqtt server

C++
17
2 年前

ROS2 Controller for the Adafruit 16 channel PWM servo I²C board, hat and similar PCA9685 based boards, provides absolute proportional PWM control as well as supports geometry_msgs/Twist.

C++
16
10 个月前

Robotic arm to be printed on the 3D printer controlled by Raspberry Pi, PCA9685 for servomotors and programmed in Python.

13
3 年前

Miscellaneous PCB Works

12
3 年前

Control LEDs connected to a micro controller using pulse-width modulation.

Python
12
2 年前

A robot with tiny hands

Rust
10
2 年前

Qt implementation of I2C protocol for RaspberryPi along with some i2c sensors, in particular: TOF10120, VL53l1X, VL6180X, MPU6050, QMC5883L, TCA9548A, PCA9685

C++
10
4 年前

A Pca9685 golang library.

Go
10
7 年前