Oscar Lima
Oscar Lima
warning 1: ```/usr/bin/xauth: file /home/jetson/.Xauthority does not exist```
Extend code to allow not only this: ``` model://ground_plane ``` but also this: ``` file://foo_folder/bar_model ```
https://github.com/socrob/robocup-at-work/blob/kinetic/mas_industrial_robotics/mir_navigation/mir_2dslam/ros/launch/2dslam.launch
A student had problems with the setup of AMCL in Stage, here I post some launch files and code for it
You can use this as an example launch file for your projects, it has a bit of most common features used in launch file programming/design: ``` ```
``` #!/usr/bin/env python import rospy from nav_msgs.msg import Odometry from sensor_msgs.msg import LaserScan class EKFLocalizationKinect(object): ''' listens to topic emotions, turns on/off different LED'S of the mbot head to mimic...
We are having some troubles teleoperating the pioneer using a command pc with virtualbox, but if we use 2 pcs with dual boot ubuntu-windows it works fine (the problem is...
Question: We have some problems with the lookupTransform. We are asking the more recent position of the robot and upon a time it returns us an older position instead of...
https://github.com/mas-group/robocup-at-work/blob/leipzig-2016/mas_common_robotics/mcr_navigation/mcr_recovery_behaviors/ros/src/force_field_recovery.cpp
is moved now to https://github.com/socrob/autonomous_systems_datasets