Ros(fuerte)+rgbdslam_freiburg+installation...
分类:
其他好文 时间:
2015-06-25 17:30:34
阅读次数:
233
(ros/navigation) navigation导航中一些重要话题的来源和去路,对理解程序有很大帮助
topic1: cmd_vel
Type: geometry_msgs/Twist
Publishers:
* /move_base
Subscribers:
* none
topic2: /move_base/Nav...
分类:
其他好文 时间:
2015-06-25 14:03:34
阅读次数:
430
怎样终止正在进行的导航navigation
how to cancel a navigation goal or how to stop current navigation?
导航时,取消当前目标点或者暂停导航是一个常见的问题
经过查阅资料.发现仅用如下一条指令即可另导航停止,小车停止:
rostopic pub /move_base/cancel actionlib_msg...
分类:
其他好文 时间:
2015-06-23 18:08:19
阅读次数:
722
创建hello.world
You should see output similar to:
Gazebo multi-robot simulator, version 1.9.5
Copyright (C) 2013 Open Source Robotics Foundation.
Released under the Apache 2 Licens...
分类:
其他好文 时间:
2015-06-22 17:54:45
阅读次数:
116
Plugin Types
There are currently 5 types of plugins
WorldModelSensorSystem.Visual.
Hello WorldPlugin!
#include
namespace gazebo
{
class WorldPluginTutorial : public WorldPlugin
{
...
分类:
其他好文 时间:
2015-06-22 17:53:49
阅读次数:
156
Camera
RRBot Example
rrbot.xacro
rrbot.g...
分类:
其他好文 时间:
2015-06-22 16:28:06
阅读次数:
156
RRBot Example
rrbot.gazebo
...
分类:
其他好文 时间:
2015-06-22 16:27:17
阅读次数:
180
For the purposes of gazebo_ros_control in its current implementation, the only important information in these transmission tags are:
- the name must correspond to a joint else where in your URDF -...
分类:
其他好文 时间:
2015-06-22 16:26:34
阅读次数:
160
CMakeLists.txt
cmake_minimum_required(VERSION 2.8.3)
project(YOURROBOT_gazebo_plugins)
find_package(catkin REQUIRED COMPONENTS
gazebo_ros
)
# Depend on system install of Gazebo
find_package(gazeb...
分类:
其他好文 时间:
2015-06-22 11:10:43
阅读次数:
136
1.使用mavlink based软件 没有ROS2.使用无线连接,没有ROS3.Onboard computer + ROS + WiFi link (recommended)Control Methods 有下面两种方式1. Offboard Control with Custom Code参考...
分类:
其他好文 时间:
2015-06-17 16:36:54
阅读次数:
636