ROS Resources: Documentation | Support | Discussion Forum | Index | Service Status | ros @ Robotics Stack Exchange
Ask Your Question

Tonystark124's profile - activity

2017-10-07 02:15:14 -0500 received badge  Famous Question (source)
2017-09-26 03:10:57 -0500 received badge  Popular Question (source)
2017-09-26 03:10:57 -0500 received badge  Notable Question (source)
2017-07-29 02:42:05 -0500 marked best answer Error reading end tag - Model parsing the xml failed

I am working on a sample exercise of creating an arm robot with 3 links and 2 joints, by defining the urdf file. Am also following the tutorial from Mastering ROS for Robotics Programmin by Lentin Joseph. I have the following code

     <?xml version="1.0"?>
    <robot name="pan_tilt">

    <link name="base_link">
    <visual>
        <geometry>
            <cylinder length="0.01" radius="0.2"/>
        </geometry>
        <origin rpy="0 0 0" xyz="0 0 0"/>
        <material name="yellow">
            <color rgba="1 1 0 1"/>
        </material>
    </visual>
</link>

<joint name="pan_joint" type="revolute">
    <parent link="base_link"/>
    <child link="pan_link"/>
    <origin xyz="0 0 0.1"/>
    <axis xyz="0 0 0"/>
</joint>

<link name="pan_link">
    <visual>
        <geometry>
            <cylindder length="0.4" radius="0,04"/>
        </geomtry>
        <origin rpy="0 0 0" xyz="0 0 0.09"/>
        <material name="red">
            <color rgba="0 0 1 1"/>
        </material>
    </visual>
</link>

<joint name="tilt_joint" type="revolute">
    <parent link="pan_link"/>
    <child link="tilt_link"/>
    <origin xyz="0 0 0.2"/>
    <axis xyz="0 1 0"/>
</joint>

<link name="tilt_link">
    <visual>
        <geometry>
            <cylindder length="0.4" radius="0,04"/>
        </geomtry>
        <origin rpy="0 1.5 0" xyz="0 0 0.0"/>
        <material name="green">
            <color rgba="1 0 0 1"/>
        </material>
    </visual>
</link>
</robot>

while running

    check_urdf pan_tilt.urdf

I get the following error :

    Error:   Error reading end tag.
     at line 72 in /build/buildd/urdfdom-0.2.10+dfsg/urdf_parser/src/model.cpp
    ERROR: Model Parsing the xml failed

The code is straight out of the tutorials. Can you please point out where the mistake is?

2017-07-29 02:42:04 -0500 commented answer Error reading end tag - Model parsing the xml failed

Thank you for your help. It worked for debug.!

2017-07-28 17:38:31 -0500 asked a question Error reading end tag - Model parsing the xml failed

Error reading end tag - Model parsing the xml failed I am working on a sample exercise of creating an arm robot with 3 l

2017-07-16 11:16:51 -0500 commented answer How to install ROS indigo in Ubuntu 14.04 trusty 64-bit?

removing gazebo did it for me

2017-04-20 16:52:05 -0500 marked best answer Couldn't find executable named drone_stateestimation

I am trying to fly the ardrone parrot 2.0 using tum_ardrone ptam module. It is a rospackage, so I had to make it using

       rosmake tum_ardrone

The above compiled with 0 failures. however, when I do the following commad

       rosrun tum_ardrone drone_stateestimation

I get the following error

      [rosrun] Couldn't find executable named drone_stateestimation below

      /home/bojan/fuerte_workspace/tum_ardrone

I tried to google and get a solid pipelined solution to check for the reason for this error and solve it, but I did not get it. Am new to ubuntu, thus your help is much appreicated. This error doesn't seem to be package specific since the same package works fine in another laptop I tested. Am runnign Ubuntu in vmWare. Does that make any difference?

Thanks in advance

UPDATE :

This is the ROS_PACKAGE_PATH as you asked.

/home/bojan/fuerte_workspace:/opt/ros/fuerte/share:/opt/ros/fuerte/stacks

The first path is the path I get after roscd. Please let me know if this information helps.

2016-07-04 11:37:31 -0500 received badge  Student (source)
2016-03-14 05:34:48 -0500 received badge  Famous Question (source)
2016-03-14 05:34:48 -0500 received badge  Notable Question (source)
2016-02-28 04:43:10 -0500 received badge  Notable Question (source)
2015-12-21 00:52:31 -0500 received badge  Famous Question (source)
2015-12-04 08:11:23 -0500 received badge  Popular Question (source)
2015-11-06 00:02:09 -0500 received badge  Famous Question (source)
2015-10-28 03:37:50 -0500 received badge  Notable Question (source)
2015-09-11 08:48:07 -0500 asked a question Spawn hector quadrotor in custom gazebo world.

I created a custom world using model editor in gazebo4,

I was trying to run a fun project where I can fly the quadrotor model through the rings I created in the custom world, using vision based algorithm and solution. Thus, I came across hector quadrotor and wanted to use the robot model in this world.

This command can spawn the quadrotor into an empty world

    roslaunch gazebo_ros empty_world.launch

but this requires to have gazebo_ros. and that would remove gazebo4 and this world I created. Can I spawn the hector quadrotor directly into this world of gazebo4?

2015-08-28 00:27:14 -0500 received badge  Popular Question (source)
2015-08-18 14:22:02 -0500 answered a question Mac installation Error

Try running sudo rosdep update.

You will get few warning messages, but I guess we can skip that.

2015-08-03 16:36:01 -0500 received badge  Popular Question (source)
2015-08-02 21:10:47 -0500 asked a question Reconstruction.yaml missing from stereo slam package

I am trying to use a stereo slam package from here,and by following the instructions, I completed the installation. I am trying to run this slam with drcsim Atlas bot, spawned in a gazebo vrc task environment.

Now, by editing the demo.launch file of the package, I can link the stereo_slam package to subscribe to topics which provide with the stereo pair of images. The edited launch file

    <launch>

<arg name="bagfile" default="/tmp/ROS.bag"/>

<!-- Setup the camera -->
<arg name="camera" default="/multisense_sl/camera/"/>
<param name="/use_sim_time" value="true"/>

<!-- Play the bagfile -->
<node pkg="rosbag" type="play" name="rosbag" args="--clock $(arg bagfile)"/>

<!-- Run the stereo image proc -->
<group ns="$(arg camera)">
    <node pkg="stereo_image_proc" type="stereo_image_proc" name="stereo_image_proc" />
</group>

<!-- Run the visual odometry: You can choose between viso2 and fovis -->
<node pkg="viso2_ros" type="stereo_odometer" name="stereo_odometer">
    <remap from="stereo" to="$(arg camera)"/>
    <remap from="image" to="image_color"/>
    <param name="base_link_frame_id" value="/pelvis"/>
</node>
<!--node pkg="fovis_ros" type="stereo_odometer" name="fovis">
    <remap from="stereo" to="$(arg camera)"/>
    <remap from="image" to="image_color"/>
    <param name="base_link_frame_id" value="/pelvis"/>
</node-->

<!-- Stereo SLAM -->
<node pkg="stereo_slam" type="localization" name="slam" output="screen">

    <!-- Working directory -->
    <param name="work_dir" value="/home/tonystark/freelancing/Atlas_slam/slam/" />

    <!-- Topic parameters -->
    <param name="odom_topic" value="stereo_odometer/odometry"/>
    <param name="left_topic" value="$(arg camera)/left/image_color"/>
    <param name="right_topic" value="$(arg camera)/right/image_color"/>
    <param name="left_info_topic" value="$(arg camera)/left/camera_info"/>
    <param name="right_info_topic" value="$(arg camera)/right/camera_info"/>

    <!-- Min displacement between graph vertices (in meters) -->
    <param name="min_displacement" value="0.25"/>

    <!-- Descriptor type: SIFT or SURF -->
    <param name="desc_type" value="SIFT"/>

    <!-- Can be "CROSSCHECK" or "RATIO" -->
    <param name="desc_matching_type" value="CROSSCHECK"/>

    <!-- Descriptor threshold for crosscheck matching (typically between 0.7-0.9) or ratio for ratio matching (typically between 0.6-0.8).  -->
    <param name="desc_thresh_ratio" value="0.88" />

    <!-- Minimum number of neighbors that will be skiped for the loop closure (tipically between 5-20, but depends on the frame rate) -->
    <param name="min_neighbor" value="10" />

    <!-- Get the n first candidates of the hash matching (tipically between 1-5) -->
    <param name="n_candidates" value="5" />

    <!-- Minimun number of descriptor matches to consider a matching as possible loop closure (>8) -->
    <param name="min_matches" value="30" />

    <!-- Minimum number of inliers to consider a matching as possible loop closure (>8) -->
    <param name="min_inliers" value="15" />

    <!-- Set to 0 for LinearSlam Solver with gauss-newton. Set to 1 for LinearSlam Solver with Levenberg -->
    <param name="g2o_algorithm" value="0" />

    <!-- Maximum number of iteration for the g2o algorithm -->
    <param name="g2o_opt_max_iter" value="10" />
</node>

<!-- Pointcloud collector -->
<node pkg="stereo_slam" type="collector" name="collector" output="screen">

    <param name="work_dir" value="/home/tonystark/freelancing/Atlas_slam/slam/" />

    <param name="graph_topic" value="slam/graph"/>
    <param name="cloud_topic" value="$(arg camera)/scaled/points2"/>

    <rosparam file="$(find stereo_slam)/etc/reconstruction.yaml" />

</node>

</launch>

When executing

    roslaunch stereo_slam demo.launch

I get the following error

    error loading <rosparam> tag: 
file does not exist [/home/tonystark/lib_haloc/src/stereo_slam/etc/reconstruction.yaml]
    XML is <rosparam file="$(find stereo_slam)/etc/reconstruction.yaml"/>
    The traceback for ...
(more)
2015-08-02 09:29:45 -0500 received badge  Notable Question (source)
2015-08-02 07:44:34 -0500 asked a question Move the head of Atlas in Gazebo - DRCSIM

Hello,

I am trying to work with the Atlas in DRCSIM, and using this link, I knew how to eprform fake walking, and move the bot. This link shows how to visualize andlog using rviz, spawning the bot in an environment in Gazebo.

I used Atlas in vrc_task3 environment, launching it using

    VRC_CHEATS_ENABLED=1 roslaunch drcsim_gazebo vrc_task_3.launch

In the given environment, on a closer lookup, the head of the bot is seeing upwards, because of which, the images I view in rviz are also in the slanted angle. I am trying to implement SLAM solution using the Atlas DRCSIM and this is not a probable scenario for me. How can I move the head of the bot to align it with a straight view

(P.S : My points are less than 5 thus, am not able to upload images and show you the exact case, but hope you can understand. Please help me.)

2015-07-14 23:09:07 -0500 commented answer catkin_package() include dir 'include' does not exist

issues resolved. thanks,! :)

2015-07-14 23:09:07 -0500 received badge  Commentator
2015-07-14 16:06:31 -0500 received badge  Popular Question (source)
2015-07-14 06:29:34 -0500 commented answer catkin_package() include dir 'include' does not exist

fatal error: pcl/point_cloud.h: No such file or directory I got this error while compiling/installing. Any ideas if you had the same?

2015-07-14 06:28:09 -0500 received badge  Scholar (source)
2015-07-14 06:23:38 -0500 commented answer catkin_package() include dir 'include' does not exist

can you please point to where I can look for it?

2015-07-14 06:23:12 -0500 commented answer catkin_package() include dir 'include' does not exist

I got the package from the link mentioned

2015-07-14 06:00:38 -0500 asked a question catkin_package() include dir 'include' does not exist

I am trying to install viso2_ros package from here, when I encounter the following error while I catkin_make

    CMake Error at /opt/ros/indigo/share/catkin/cmake/catkin_package.cmake:296 (message):
    catkin_package() include dir 'include' does not exist relative to
    '/home/tonystark/vision_odometry/src/dlut_smartrob/dlut_motor_hokuyo'
    Call Stack (most recent call first):
    /opt/ros/indigo/share/catkin/cmake/catkin_package.cmake:98 (_catkin_package)
   dlut_smartrob/dlut_motor_hokuyo/CMakeLists.txt:50 (catkin_package)


  -- Configuring incomplete, errors occurred!
  See also "/home/tonystark/vision_odometry/build/CMakeFiles/CMakeOutput.log". 
  See also "/home/tonystark/vision_odometry/build/CMakeFiles/CMakeError.log".

Can you please tell me how I can solve this? Thanks in advance.

If the way am installing is wrong, can you please point me towards the correct direction?

2015-07-14 04:22:07 -0500 received badge  Popular Question (source)
2015-07-14 00:05:09 -0500 commented answer Integrate VSLAM with Atlas in DRCsim

I am using Ros Indigo by the way

2015-07-13 14:07:10 -0500 commented answer Integrate VSLAM with Atlas in DRCsim

Thanks a lot for the answer. It was really valuable. Could you please suggest me some good VSLAM package I can use to achieve the same?

2015-07-13 03:13:57 -0500 asked a question Integrate VSLAM with Atlas in DRCsim

Hello,

I am new to using DRCSIM and Atlas, but through tutorials, I was able to get through the basics of configuring rviz, gazebo,and the worlds for the bot.

Suppose I want to VSLAM with the Atlas in drcsim, in the world present in gazebo, can you please give me directions as to where I should start and how I can achieve this?

2014-06-26 07:31:52 -0500 received badge  Famous Question (source)
2014-05-26 01:52:23 -0500 received badge  Popular Question (source)
2014-05-26 01:52:23 -0500 received badge  Notable Question (source)
2014-05-12 15:25:05 -0500 received badge  Famous Question (source)
2014-05-12 14:49:15 -0500 received badge  Notable Question (source)