Wiki

Only released in EOL distros:  

smartrob: dlut_motor_hokuyo | dlut_move_base | dlut_pc_odom

Package Summary

dlut_move_base

dlut_smartrob: dlut_motor_hokuyo | dlut_move_base | dlut_pc_odom

Package Summary

The dlut_move_base package

  • Maintainer: Zhuang Yan <zhuang AT dlut.edu DOT cn>, Wu Nai Liang <wunailiang AT gmail DOT com>
  • Author: Zhuang Yan <zhuang AT dlut.edu DOT cn>, Yan Fei, Dong Bing Bing
  • License: BSD
  • Source: git https://github.com/ZhuangYanDLUT/dlut_smartrob.git (branch: groovy-devel)
dlut_smartrob: dlut_motor_hokuyo | dlut_move_base | dlut_pc_odom

Package Summary

The dlut_move_base package

  • Maintainer: Zhuang Yan <zhuang AT dlut.edu DOT cn>, Wu Nai Liang <wunailiang AT gmail DOT com>
  • Author: Zhuang Yan <zhuang AT dlut.edu DOT cn>, Yan Fei, Dong Bing Bing
  • License: BSD
  • Source: git https://github.com/ZhuangYanDLUT/dlut_smartrob.git (branch: indigo-devel)

Overview

dlut_move_base is a package associated with control and movement of the robot “SmartROB” our lab developed independently. The serial_com node is a base controller node.It must run on a computer attached directly to the motor controller by serial port.And the sick_key node is used to get the command from the keyboard.

Usage

Node "serial_com" can be started by running:

Toggle line numbers
   1 rosrun dlut_move_base serial_com

Node "sick_key" can be started by running:

Toggle line numbers
   1 rosrun dlut_move_base sick_key

Nodes

serial_com

The serial_com node is a base controller node.It must run on a computer attached directly to the motor controller by serial port.

Subscribed Topics

cmd_velocity (dlut_move_base/Velocity) cmd_twist (dlut_move_base/Twist)

Published Topics

robot_velocity (dlut_move_base/Twist) odom (nav_msgs/Odometry)

Parameters

Port (int, default: 2) BaudRate (int, default: 9600)

sick_key

The sick_key node is used to get the command from the keyboard.

Published Topics

is_run (std_msgs/Bool) is_run_pch (std_msgs/Bool) cmd_velocity (dlut_move_base/Velocity)

Parameters

scale_angular (double, default: 0.1) scale_linear (double, default: 0.1)

Bug Reports & Feature Requests

We appreciate the time and effort spent submitting bug reports.

Wiki: dlut_move_base (last edited 2013-05-07 01:50:07 by dbb1987)