Browse Source

更新代码注释信息

corvin 3 years ago
parent
commit
344e63fb6f

+ 1 - 17
src/robot_bringup/launch/odom_ekf.py

@@ -1,25 +1,9 @@
 #!/usr/bin/env python
 
-""" odom_ekf.py - Version 1.1 2013-12-20
-
+"""
     Republish the /robot_pose_ekf/odom_combined topic which is of type
     geometry_msgs/PoseWithCovarianceStamped as an equivalent message of
     type nav_msgs/Odometry so we can view it in RViz.
-
-    Created for the Pi Robot Project: http://www.pirobot.org
-    Copyright (c) 2012 Patrick Goebel.  All rights reserved.
-
-    This program is free software; you can redistribute it and/or modify
-    it under the terms of the GNU General Public License as published by
-    the Free Software Foundation; either version 2 of the License, or
-    (at your option) any later version.5
-
-    This program is distributed in the hope that it will be useful,
-    but WITHOUT ANY WARRANTY; without even the implied warranty of
-    MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE.  See the
-    GNU General Public License for more details at:
-
-    http://www.gnu.org/licenses/gpl.html
 """
 import rospy
 from geometry_msgs.msg import PoseWithCovarianceStamped

+ 2 - 1
src/robot_bringup/launch/robot_bringup.launch

@@ -1,5 +1,5 @@
 <!--
-  Copyright: 2016-2020 ROS小课堂 www.corvin.cn
+  Copyright: 2016-2021 ROS小课堂 www.corvin.cn
   Description:robot启动时最先需要启动的launch文件,主要加载各基础功能模块启动。
     首先就需要启动机器人的urdf文件,这样就可以在rviz中可视化显示机器人模型.然后
     启动下位机arduino的程序,上下位机建立连接,这样上位机就可以发送控制命令.接下来
@@ -40,3 +40,4 @@
         <remap from="output" to="/odom_ekf" />
     </node>
 </launch>
+

+ 1 - 1
src/ros_arduino_bridge/ros_arduino_python/launch/arduino.launch

@@ -1,5 +1,5 @@
 <!--
-  Copyright: 2016-2020 ROS小课堂 www.corvin.cn
+  Copyright: 2016-2021 ROS小课堂 www.corvin.cn
   Description:
     启动底盘arduino的上位机launch文件.
   Author: corvin

+ 1 - 1
src/ros_arduino_bridge/ros_arduino_python/src/ros_arduino_python/base_controller.py

@@ -2,7 +2,7 @@
 #-*- coding:utf-8 -*-
 
 """
-  Copyright: 2016-2020 www.corvin.cn ROS小课堂
+  Copyright: 2016-2021 www.corvin.cn ROS小课堂
   Description:  A base controller class for the Arduino DUE microcontroller
   Author: corvin
   History:

+ 0 - 34
src/teleop_twist_keyboard/CHANGELOG.rst

@@ -1,34 +0,0 @@
-0.6.2 (2018-10-21)
-------------------
-* Replace tabs with spaces, fixes `#15 <https://github.com/ros-teleop/teleop_twist_keyboard/issues/15>`_
-* Merge pull request `#13 <https://github.com/ros-teleop/teleop_twist_keyboard/issues/13>`_ from asukiaaa/patch-3
-  Add rosrun command to specify values
-* Add rosrun command to specify values
-* Contributors: Asuki Kono, Austin, trainman419
-
-0.6.1 (2018-05-02)
-------------------
-* Merge pull request `#11 <https://github.com/ros-teleop/teleop_twist_keyboard/issues/11>`_ from MatthijsBurgh/patch-1
-  Correct exception handling; Python3 print compatible
-* import print from future
-* Print python3 compatible
-* correct Exception handling
-* Merge pull request `#7 <https://github.com/ros-teleop/teleop_twist_keyboard/issues/7>`_ from lucasw/speed_params
-  set linear and turn speed via rosparams
-* Using tabs instead of spaces to match rest of file
-* set linear and turn speed via rosparams
-* Contributors: Austin, Lucas Walter, Matthijs van der Burgh
-
-0.6.0 (2016-03-21)
-------------------
-* Better instruction formatting
-* support holonomic base, send commmand with keyboard down
-* Fixing queue_size warning
-* Create README.md
-* Update the description string in package.xml
-* Contributors: Austin, Kei Okada, LiohAu, Mike Purvis, kk6axq, trainman419
-
-0.5.0 (2014-02-11)
-------------------
-* Initial import from brown_remotelab
-* Convert to catkin

+ 1 - 4
src/teleop_twist_keyboard/teleop_twist_keyboard.py

@@ -1,19 +1,16 @@
 #!/usr/bin/env python
 # coding:utf-8
 
-# Copyright: 2016-2020 wwww.corvin.cn ROS小课堂
+# Copyright: 2016-2021 wwww.corvin.cn ROS小课堂
 # Description: 通过键盘遥控小车行进,摄像头舵机转动。
 # History:
 #    20200726: 增加控制左右转动舵机的代码.
 
 from __future__ import print_function
-
 import roslib; roslib.load_manifest('teleop_twist_keyboard')
 import rospy
 from geometry_msgs.msg import Twist
-
 import sys, select, termios, tty
-
 from ros_arduino_msgs.srv import CameraControl
 import time