快速搭建全向轮小车

总体介绍

使用两块ordive控制ros-mobile app进行控制,odrive通过python可以轻松控制,ros-mobile可以进行与电脑的ros连接充当一个遥控器。

记录代码

读取rosmobile的遥控数据

#!/usr/bin/env python3import threading
import time
from queue import Queueimport rospy
from std_msgs.msg import String
from geometry_msgs.msg import Twist
from car_contral import * cQue = Queue(20)def CarRun():# init CarmyCar = Car()myCar.requestStatus()# init speedspeedvx = 0.speedvy = 0.speedw = 0.kv = 40kw = 100while not rospy.is_shutdown():v = cQue.get()if(len(v)==1):speedw = v[0]if(len(v)==2):speedvx = v[0]speedvy = v[1]print(speedvx, speedvy, speedw)myCar.carModel(kv * speedvx, kv * speedvy, kw * speedw)def callbackLeft(data):# rospy.loginfo(data)v1 = data.linear.x * 0.5v2 = data.linear.y * 0.5 cQue.put([v2, -v1])# 这里是摇杆与小车之间坐标系需要反一下def callbackRight(data):angular = data.angular.z * 0.5cQue.put([-angular])# 这里也是反的def listener():rospy.init_node('listener', anonymous=True)rospy.Subscriber("cmd_vel", Twist, callbackLeft)rospy.Subscriber("cmd_vel2", Twist, callbackRight)rospy.spin()if __name__ == '__main__':carThread = threading.Thread(target=CarRun)carThread.start()listener()

odrive控制

(参考知乎-华北舵狗王)

#!/usr/bin/env python3from __future__ import print_functionimport odrive
from odrive.enums import *
import time
import math
from fibre import Logger, Event
from odrive.utils import OperationAbortedException
from fibre.protocol import ChannelBrokenException
import sysdef set_gains(odrv,axis):"""Sets the nested PID gains to a good default"""axis.controller.config.pos_gain = 100.0 #f [(counts/s) / counts]axis.controller.config.pos_gain = 0.01 #f [(counts/s) / counts]axis.controller.config.vel_gain = 5.0 / 10000.0 #[A/(counts/s)]axis.controller.config.vel_limit = 50000.0axis.controller.config.vel_integrator_gain = 0 #[A/((counts/s) * s)]axis.controller.config.kp_theta = 0.04 *  6000 / (2 * math.pi)axis.controller.config.kd_theta = 5.0 / 10000.0 *  6000 / (2 * math.pi)axis.controller.config.kp_gamma = 0.0 *  6000 / (2 * math.m2)axis.controller.config.kd_gamma = 5.0 / 10000.0 *  6000 / (2 * math.pi)def calibrate_motor(odrv, axis):# time.sleep(0.5)print('Calibrating motor...',end='',flush=True)run_state(axis, AXIS_STATE_MOTOR_CALIBRATION, True)axis.motor.config.pre_calibrated = True# then set motor pre calibrated to trueprint('Done');def calibrate_motor_and_zencoder(odrv,axis):"""Runs motor and encoder calibration (with z index) and savesEnables closed loop control on startup and encoder search on startup"""calibrate_motor(odrv, axis)print('Calibrating encoder...',end='',flush=True)axis.encoder.config.use_index = Truerun_state(axis, AXIS_STATE_ENCODER_INDEX_SEARCH, True)run_state(axis, AXIS_STATE_ENCODER_OFFSET_CALIBRATION, True)axis.encoder.config.pre_calibrated = Trueprint('Done');print('Setting startup flags...',end='',flush=True)# axis.config.startup_encoder_index_search = Trueaxis.config.startup_encoder_index_search = Trueaxis.config.startup_closed_loop_control = Trueprint('Done with axis.')def run_state(axis, requested_state, wait):"""Sets the requested state on the given axis. If wait is True, the methodwill block until the state goes back to idle.Returns whether the odrive went back to idle in the given timeout period,which is 10s by default."""axis.requested_state = requested_statetimeout_ctr = 100; # 20s timeout for encoder calibration to finishif wait:while(timeout_ctr > 0): # waits until state goes back to idle to continuetime.sleep(0.2)timeout_ctr -= 1if axis.current_state == AXIS_STATE_IDLE:breakreturn timeout_ctr > 0def reboot_odrive(odrv):"""Reboot odrive"""try:odrv.reboot()except ChannelBrokenException:print('Lost connection because of reboot...')def reset_odrive(odrv):"""Erase config"""print('Erasing config and rebooting...')odrv.erase_configuration()reboot_odrive(odrv)def init_odrive(odrv):"""NOTE: does not save"""print('Initializing ODrive...')odrv.config.brake_resistance = 0odrv.axis0.motor.config.pole_pairs = 11odrv.axis1.motor.config.pole_pairs = 11odrv.axis0.motor.config.resistance_calib_max_voltage = 4.0odrv.axis1.motor.config.resistance_calib_max_voltage = 4.0odrv.axis0.encoder.config.cpr = 4000odrv.axis1.encoder.config.cpr = 4000odrv.axis0.motor.config.current_lim = 25 #40odrv.axis1.motor.config.current_lim = 25 #40odrv.axis0.motor.config.calibration_current = 10odrv.axis1.motor.config.calibration_current = 10odrv.axis0.motor.config.pre_calibrated = Falseodrv.axis1.motor.config.pre_calibrated = Falseodrv.axis0.encoder.config.pre_calibrated = Falseodrv.axis1.encoder.config.pre_calibrated = Falseprint('Done.')def set_odrive_limits(odrv,axis,cur_lim):"""Set motor current limits"""axis.motor.config.current_lim = current_limdef calibrate_odrive(odrv):"""Calibrate motors and encoders (including index) on both axes"""print('Calibrating axes...')calibrate_motor_and_zencoder(odrv,odrv.axis0)calibrate_motor_and_zencoder(odrv,odrv.axis1)print('Done.')def set_odrive_gains(odrv):"""Set position control gains for both motors"""print('Setting gains...')set_gains(odrv,odrv.axis0)set_gains(odrv,odrv.axis1)print('Done.')def test_odrive_motors(odrv):"""Give two position commands to both axis"""print('Testing motors...')odrv.axis0.requested_state = AXIS_STATE_CLOSED_LOOP_CONTROLodrv.axis1.requested_state = AXIS_STATE_CLOSED_LOOP_CONTROLtime.sleep(0.5)odrv.axis0.controller.set_pos_setpoint(1000.0, 0.0, 0.0)odrv.axis1.controller.set_pos_setpoint(-1000.0, 0.0, 0.0)time.sleep(1)odrv.axis0.controller.set_pos_setpoint(0.0, 0.0, 0.0)odrv.axis1.controller.set_pos_setpoint(0.0, 0.0, 0.0)print('Done.')def get_odrive(shutdown_token):"""Look for and return an odrive connected via usb"""print('Looking for ODrive...')odrv = odrive.find_any(serial_number='385B38543439')print('Found.')return odrvdef print_configs(odrv0):"""Print configuration info"""print('\n\nMOTOR CONFIG')print(odrv0.axis0.motor.config)print('\n')print(odrv0.axis1.motor.config)print('\n\n ENC CONFIG')print(odrv0.axis0.encoder.config)print('\n')print(odrv0.axis1.encoder.config)print('\n\n AXIS CONFIG')print(odrv0.axis0.config)print('\n')print(odrv0.axis1.config)def full_calibration(app_shutdown_token):"""Reset the odrive and calibrate everything:1) Gains and limits2) Motor3) Encoder index4) Encoder offset5) Set startup"""# Find a connected ODrive (this will block until you connect one)odrv0 = get_odrive(app_shutdown_token)reset_odrive(odrv0)odrv0 = get_odrive(app_shutdown_token)init_odrive(odrv0)set_odrive_gains(odrv0)calibrate_odrive(odrv0)odrv0.save_configuration()#run_state(axis=odrv0.axis0, requested_state=AXIS_STATE_CLOSED_LOOP_CONTROL, wait=False);#run_state(axis=odrv0.axis1, requested_state=AXIS_STATE_CLOSED_LOOP_CONTROL, wait=False);#odrv0.axis0.controller.pos_setpoint = 0;#odrv0.axis1.controller.pos_setpoint = 0;print_configs(odrv0)def bare_bones_calibration(app_shutdown_token, reset=True):"""Just calibrate motors and basic gains"""print("Run doghome\n ")odrv0 = get_odrive(app_shutdown_token)# print(odrv0)# if reset:#     reset_odrive(odrv0)#     odrv0 = get_odrive(app_shutdown_token)# init_odrive(odrv0)# set_odrive_gains(odrv0)# calibrate_motor(odrv0, odrv0.axis0)# calibrate_motor(odrv0, odrv0.axis1)# odrv0.axis0.config.startup_encoder_offset_calibration = True# odrv0.axis1.config.startup_encoder_offset_calibration = True# odrv0.axis0.config.startup_closed_loop_control = True# odrv0.axis1.config.startup_closed_loop_control = True# odrv0.axis0.encoder.config.use_index = False# odrv0.axis1.encoder.config.use_index = False# odrv0.axis0.config.startup_encoder_index_search =False# odrv0.axis1.config.startup_encoder_index_search =False# odrv0.save_configuration()# print_configs(odrv0)def main(app_shutdown_token):"""!! Main program !!Looks for odrive, then calibrates, then sets gains, then tests motorsWARNING: Saving more than twice per boot will cause a reversion of all changes"""bare_bones_calibration(app_shutdown_token, reset=True)#bare_bones_calibration(app_shutdown_token, reset=False)import odrive
from fibre import Logger, Event
from odrive.utils import OperationAbortedException
from fibre.protocol import ChannelBrokenExceptionapp_shutdown_token = Event()
try:main(app_shutdown_token)# init_odrive(odrv0)
except OperationAbortedException:logger.info("Operation aborted.")
finally:app_shutdown_token.set()# encoder calibration
# set use_index ot true
# request encoder_index_search
# pre_calibrated to True
# then change startup to encoder_index_search true

机器人控制

#!/usr/bin/env python3
import odrive
from odrive.enums import *
from fibre import Logger, Event# 赋值速度
class Car:odrv0 = Noneodrv1 = NonemaxSpeed = 60.isInverse = [1., 1., -1.] # 电机是否需要正反向参数def __init__(self): print('Looking for ODrive...')self.odrv0 = odrive.find_any(serial_number='385B38543439')self.odrv1 = odrive.find_any(serial_number='346933773433')print('Found.')# 进入闭环def requestStatus(self):self.odrv0.axis0.requested_state = AXIS_STATE_CLOSED_LOOP_CONTROLself.odrv0.axis1.requested_state = AXIS_STATE_CLOSED_LOOP_CONTROLself.odrv1.axis0.requested_state = AXIS_STATE_CLOSED_LOOP_CONTROL# odrv1.axis1.requested_state = AXIS_STATE_CLOSED_LOOP_CONTROL# 释放电机def releaseMoto(self):self.odrv0.axis0.requested_state = AXIS_STATE_IDLEself.odrv0.axis1.requested_state = AXIS_STATE_IDLEself.odrv1.axis0.requested_state = AXIS_STATE_IDLE# 设置三个电机的速度def setVelocity(self, m0, m1, m2):if(m0 > self.maxSpeed):m0 = self.maxSpeedif (m0 < -self.maxSpeed):m0 = -self.maxSpeedif(m1 > self.maxSpeed):m1 = self.maxSpeedif(m1 < -self.maxSpeed):m1 = -self.maxSpeedif(m2 > self.maxSpeed):m2 = self.maxSpeedif(m2 < -self.maxSpeed):m2 = -self.maxSpeedself.odrv0.axis0.controller.input_vel = m0 * self.isInverse[0]self.odrv0.axis1.controller.input_vel = m1 * self.isInverse[1]self.odrv1.axis0.controller.input_vel = m2 * self.isInverse[2]# 根据小车模型计算速度def carModel(self, vx, vy, vw):d = 0.2# m1 =   0. + vy +                          vw*d# m2 = -1.732050808/2 * vx -    0.5 * vy +  vw*d# m3 =  1.732050808/2 * vx -    0.5 * vy +  vw*dm1 = - 1.732050808 / 2 * vx + 0.5 * vy + vw * dm2 =  0                            -vy + vw * dm3 =   1.732050808 / 2 * vx + 0.5 * vy + vw * dprint("speed = ",m1,m2,m3)self.setVelocity(m1, m2, m3)

本文来自互联网用户投稿,该文观点仅代表作者本人,不代表本站立场。本站仅提供信息存储空间服务,不拥有所有权,不承担相关法律责任。如若转载,请注明出处:http://www.mzph.cn/web/50827.shtml

如若内容造成侵权/违法违规/事实不符,请联系多彩编程网进行投诉反馈email:809451989@qq.com,一经查实,立即删除!

相关文章

景联文科技:图像标注的类型有哪些?

图像标注是计算机视觉领域中一个非常重要的步骤&#xff0c;它是创建训练数据集的关键组成部分&#xff0c;主要用于帮助机器学习算法理解图像内容。 以下是图像标注的一些主要类型&#xff1a; 1. 边界框标注&#xff1a; • 这是最常见的标注方式之一&#xff0c;通常用于…

多字段聚合查询在Elasticsearch中的实践

Elasticsearch是一个功能强大的搜索引擎&#xff0c;它不仅支持全文搜索&#xff0c;还提供了丰富的聚合功能。聚合可以帮助我们对数据进行分组和统计&#xff0c;从而得到有意义的分析结果。本文将通过Java代码示例&#xff0c;介绍如何在Elasticsearch中实现多字段的聚合查询…

第四范式发布AI+5G视频营销产品 助力精准获客与高效转化

产品上新 Product Release 今天&#xff0c;第四范式AI5G视频电话互动营销产品全新发布。 相较于以往销效率低、互动差、转化差的传统电话外呼和短信营销方式&#xff0c;视频电话互动营销基于AI、5G等技术&#xff0c;可让用户接听电话时观看个性化视频广告并实时互动&#xf…

Unity的UI设计

目录 创建和布局 布局与交互 性能优化 最佳实践 学习资源 Unity UI Toolkit与uGUI和IMGUI之间的具体区别和适用场景是什么&#xff1f; Unity UI Toolkit uGUI IMGUI 如何在Unity中实现响应式UI设计以适应不同设备尺寸&#xff1f; Unity UI性能优化的最新技术和方法…

机器学习:逻辑回归算法实现鸢尾花预测和银行数据处理

1、鸢尾花预测 1、特征选择 2、对特征处理 trainpd.read_excel("鸢尾花训练数据.xlsx") testpd.read_excel("鸢尾花测试数据.xlsx") x_traintrain[["萼片长(cm)","萼片宽(cm)","花瓣长(cm)","花瓣宽(cm)"]] y_tr…

Vue 生命周期详解含demo、面试常问问题案例

Vue 生命周期详解、面试常问问题案例 含 demo 文章目录 Vue 生命周期详解、面试常问问题案例 含 demo一、Vue 生命周期是什么二、Vue 中如何使用生命周期钩子1. **beforeCreate**2. **created**3. **beforeMount**4. **mounted**5. **beforeUpdate**6. **updated**7. **beforeD…

Grafana学习笔记

介绍 Grafana 1.1 什么是 Grafana&#xff1f; Grafana 是一个开源的数据可视化和监控平台&#xff0c;专门设计用于从各种数据源中收集和展示数据。它最初作为一个图表生成工具&#xff0c;用于显示时间序列数据&#xff0c;但已经发展成一个功能强大且灵活的仪表板工具&…

Leetcode 3259. Maximum Energy Boost From Two Drinks

Leetcode 3259. Maximum Energy Boost From Two Drinks 1. 解题思路2. 代码实现 题目链接&#xff1a;3259. Maximum Energy Boost From Two Drinks 1. 解题思路 这一题就是一个动态规划&#xff0c;分别考察下两个数列的选择即可。 2. 代码实现 给出python代码实现如下&a…

Python编写Word文档

目录 0. 安装依赖 1. 创建word文档 2. 添加标题、居中、字体16大小 3. 添加标题一 4. 添加一段话并设置字体颜色 封装函数 5. 换页 6. 插入表格 0. 安装依赖 python-docx1.1.2 1. 创建word文档 from docx import Documentdoc Document() 2. 添加标题、居中、字体1…

SQL - 数据类型

字符串类型 char(10)&#xff0c;存储固定长度字符串 varchar(255)&#xff0c;存储可变长度字符串 mediumtext&#xff0c;中文本&#xff0c;对于存储JSON对象、SCV字符串很好使 longtext&#xff0c;长文本&#xff0c;可以很好地存储教本或许多年地日志文件 tinytext&#…

php-xlswriter实现数据导出excel单元格合并,内容从指定行开始写

最终效果图&#xff1a; 代码&#xff1a; public function export_data() {$list $this->get_list_organ();$content [];$content[] []; // 第2行不设置内容&#xff0c;设置为空foreach ($list as $key > $value) {$content[] [$value[organ_name], $value[clas…

动态规划——背包问题(01背包、完全背包,分组背包与二进制优化)

本蒟蒻写二进制优化开始的时候写昏了&#xff0c;并且昏了一下午。但好在有神犇救命&#xff0c;这篇博客才得以面世——躲着人群 一、01背包 概述&#xff1a; 其常见的问题形式为&#xff1a;给出n个物品&#xff0c;每个物品有对应的价值和体积。给出背包容量后求不超过背…

象棋布局笔记

文章目录 布局中炮(当头炮)当头炮的缺点如何应对平车压马平炮对车的理解中炮对屏风马急进中兵 中炮盘头马盘头马两翼突破 盖马三锤 反宫马克制反宫马 顺手炮 士角炮56炮破解56炮 小当头 屏风马7卒分支3卒分支屏风马红车二进六败招(黑未挺7卒前直接进车)马八进九变车三退一变马二…

JNI编程二:JNI数据类型

目录 前言一、数据类型 jclass / jobject二、JNI常见的数据类型三、运用数据类型3.1 修改String类型的变量3.2 修改int类型的变量 前言 前面阐述了JNI的开发流程&#xff0c;接下来探究JNI中的数据类型。编码承接上文JNI编程一&#xff1a;JNI开发流程 一、数据类型 jclass /…

STM32——I2C和SPI波形分析

波形分析 I2C波形 //写命令 void OLED_WR_CMD(uint8_t cmd) { HAL_I2C_Mem_Write(&hi2c1 ,0x78,0x00,I2C_MEMADD_SIZE_8BIT,&cmd,1,0x100); } //写数据 void OLED_WR_DATA(uint8_t data) { HAL_I2C_Mem_Write(&hi2c1 ,0x78,0x40,I2C_MEMADD_SIZE_8BIT,&am…

第三届IEEE云计算、大数据应用与软件工程国际学术会议 (IEEE-CBASE 2024,10月11-13)

第三届IEEE云计算、大数据应用与软件工程国际学术会议 ( CBASE 2024 &#xff09;将于2024年10月11—13日在中国杭州举办。 该会议在连续两届成功举办的基础上&#xff0c;本届将由浙江水利水电学院、浙江省自动化学会、浙江省科协智能制造学会联合体主办&#xff0c;浙江水利水…

【轻松拿捏】设计模式六大基本原则(一)单一职责原则(SRP - Single Responsibility Principle)

&#x1f388;边走、边悟&#x1f388;迟早会好 一. 概述 单一职责原则&#xff08;SRP - Single Responsibility Principle&#xff09;是面向对象设计中的一个基本原则。它的核心思想是&#xff1a;一个类只应有一个引起它变化的原因&#xff0c;也就是说&#xff0c;一个类…

git clone报错unable to access

网页能够访问github.com和外网&#xff0c;git 也是安装了最新版&#xff0c;但是在使用 git clone xxx 时就报错&#xff1a; $ git clone https://github.com/XXX.git Cloning into XXX... fatal: unable to access https://github.com/XXXc.git/: OpenSSL SSL_connect: SSL…

C ++初阶:C++入门级知识点

目录 &#x1f31e;0.前言 &#x1f688;1.C输入输出 &#x1f688;2.缺省参数 &#x1f69d;2.1全缺省参数 &#x1f69d;2.2半缺省参数 &#x1f688;3.函数重载 &#x1f69d;3.1参数类型不同 &#x1f69d; 3.2参数个数不同 &#x1f69d;3.3参数类型顺序不同 ​…

相似度计算方法-编辑距离 (Edit Distance)

定义 编辑距离&#xff08;Edit Distance&#xff09;&#xff0c;也称为Levenshtein距离&#xff0c;是一种衡量两个字符串相似度的方法。它定义为从一个字符串转换为另一个字符串所需的最少单字符编辑操作次数&#xff0c;这些操作包括插入、删除或替换一个字符。 计算方法 …