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

Gen_Robotino's profile - activity

2014-06-04 07:36:31 -0500 received badge  Famous Question (source)
2012-10-30 02:39:03 -0500 received badge  Notable Question (source)
2012-10-30 02:39:03 -0500 received badge  Popular Question (source)
2012-08-29 23:22:23 -0500 received badge  Notable Question (source)
2012-08-29 23:22:23 -0500 received badge  Famous Question (source)
2012-08-29 23:22:23 -0500 received badge  Popular Question (source)
2012-08-23 22:58:47 -0500 received badge  Famous Question (source)
2012-08-23 22:58:47 -0500 received badge  Popular Question (source)
2012-08-23 22:58:47 -0500 received badge  Notable Question (source)
2012-08-16 06:01:40 -0500 received badge  Famous Question (source)
2012-08-16 06:01:40 -0500 received badge  Popular Question (source)
2012-08-16 06:01:40 -0500 received badge  Notable Question (source)
2012-07-12 23:12:15 -0500 asked a question service not moving robot in a non empty world

I am using a service client to move a robot around a world, and it successfully works for an empty world. The problem is when I launch a non empty world, the robot does not register any of the movements. Does anyone have anyone idea as to why the service client cannot communicate with the robot when not an empty world?

#include "ros/ros.h"
#include "std_msgs/String.h"
#include "gazebo_msgs/SetModelState.h"
#include "gazebo_msgs/ModelState.h"

#include <sstream>

int main(int argc, char **argv)
{

  ros::init(argc, argv, "pose_publisher");
  ros::NodeHandle n;
  ros::Publisher chatter_pub = n.advertise<gazebo_msgs::modelstate>("gazebo/set_model_state", 1000);
  ros::Rate loop_rate(10);
  int count = 0;
  bool alternate = true;
  while (ros::ok())
  {

    geometry_msgs::Pose pose;

    if(alternate){
        pose.position.x = 2.8;
        pose.position.y = 5.3;
        pose.position.z = 0.0;
        pose.orientation.x = 0.0;
        pose.orientation.y = 0.0;
        pose.orientation.z = 0.0;
        alternate = false;
    }
    else{
        pose.position.x = 1.68;
        pose.position.y = 1.68;
        pose.position.z = 0.0;
        pose.orientation.x = 0.0;
        pose.orientation.y = 0.0;
        pose.orientation.z = 0.0;
        alternate = true;
    }

    gazebo_msgs::ModelState modelstate_msg;
    modelstate_msg.model_name = "robo";
    modelstate_msg.pose = pose;

    gazebo_msgs::SetModelState setmodelstate_msg;

    // Publish robot pose
    ROS_INFO("New Pose:" );
    ROS_INFO("Pose x =%f", modelstate_msg.pose.position.x );
    ROS_INFO("Pose x =%f", modelstate_msg.pose.position.y );
    ROS_INFO("Pose x =%f", modelstate_msg.pose.position.z );

    chatter_pub.publish(modelstate_msg);
    //setmodelstate_msg.request.model_state = modelstate_msg;

    ros::spinOnce();

    loop_rate.sleep();
    ++count;
  }


  return 0;
}

2012-06-20 03:55:30 -0500 asked a question gazebo failing with .model

I am working with the objects wihin gazebo_worlds, and whenever I try and spawn .model into gazebo using the command

rosrun gazebo spawn_model -file name.model -gazebo -model thing

My gazebo gets the error

[empty_world_server-1] process has died [pid 17337, exit code 134, cmd /opt/ros/fuerte/stacks/simulator_gazebo/gazebo/scripts/gazebo /opt/ros/fuerte/stacks/simulator_gazebo/gazebo_worlds/worlds/empty.world __name:=empty_world_server __log:=/home/carol/.ros/log/715ceed4-bad5-11e1-9ffc-00268297df80/empty_world_server-1.log]. log file: /home/carol/.ros/log/715ceed4-bad5-11e1-9ffc-00268297df80/empty_world_server-1*.log

I am wondering if this is a common problem and if there is a fix to it by any chance.

2012-06-19 03:21:23 -0500 asked a question teleop not functioning with erratic

Hello, I am currently working with erratic and was able to get the robot to spawn in Gazebo by launching the launch files provided from the ros website. http://www.ros.org/wiki/erratic_description

But, the package did not include teleop, which is required to move the robot. I downloaded the teleop, and ran

rosrun erratic_teleop erratic_teleop_key

The command runs, but I am not able to move the robot. I used rxgraph, and it seems that the teleop node is not affecting the robot because it is not connected to it.

How would you make it so that the teleop node affects the erratic robot?

Thank you

2012-06-15 03:38:09 -0500 answered a question Problem spawning objects in Gazebo, Robotino

I used the command svn from the ROS website, which gave me all of the correct meshes.

2012-06-12 03:49:38 -0500 commented question Problem spawning objects in Gazebo, Robotino

I am using rosrun gazebo spawn_model -file robotino.urdf -urdf -model robotino

2012-06-12 02:54:30 -0500 received badge  Editor (source)
2012-06-11 03:08:03 -0500 asked a question Problem spawning objects in Gazebo, Robotino

Hello, I'm new to ROS, and URDF, and am working on a project in which I need to use both. I have gone through all of the tutorials on how everything works, and am trying to spawn the Robotino URDF file to no avail.

The error I keep on receiving is

Service call failed: transport error completing service call: unable to receive data from sender, check sender's logs for details

I can spawn basic objects just fine, but for some reason this URDF file just won't work. I have all of the meshes that the URDF calls as well.

I downloaded the urdf from the ROS website repostiory which included the meshes already. I am wondering if the urdf cannot find these mesh files though.

Any help would be appreicated.

My URDF is below





<robot name="robotino">
  
  <link name="base_link">
    <inertial>
      <mass value="20"/>
      <origin xyz="0 0 0"/>
      <inertia ixx="1.0" ixy="0.0" ixz="0.0" iyy="1.0" iyz="0.0" izz="1.0"/>
    </inertial>
    <visual>
      <origin rpy="0 0 1.570795" xyz="0.01 0 0"/>
      <geometry>
        <mesh filename="package://robotino_description/meshes/RobotinoBody.dae" scale="0.01 0.01 0.01"/>
      </geometry>
    </visual>
    <collision>
      <origin rpy="0 0 0" xyz="0 0 0.025"/>
      <geometry>
        <cylinder length="0.05" radius="0.18"/>
      </geometry>
    </collision>
  </link>
  <joint name="wheel0_joint" type="continuous">
    <origin rpy="0 0 1.04719666667" xyz="0.065 0.11 0.04"/>
    <axis xyz="-1 0 0"/>
    <parent link="base_link"/>
    <child link="wheel0_link"/>
  </joint>
  <link name="wheel0_link">
    <inertial>
      <mass value="0.00001"/>
      <origin xyz="0 0 0"/>
      <inertia ixx="1.0" ixy="0.0" ixz="0.0" iyy="1.0" iyz="0.0" izz="1.0"/>
    </inertial>
    <visual>
      <origin rpy="0 0 0" xyz="0 0 0"/>
      <geometry>
        <mesh filename="package://robotino_description/meshes/RobotinoWheel.dae" scale="0.01 0.01 0.01"/>
      </geometry>
    </visual>
  </link>
  <joint name="wheel1_joint" type="continuous">
    <origin rpy="0 0 0" xyz="-0.13 0 0.04"/>
    <axis xyz="1 0 0"/>
    <parent link="base_link"/>
    <child link="wheel1_link"/>
  </joint>
  <link name="wheel1_link">
    <inertial>
      <mass value="0.00001"/>
      <origin xyz="0 0 0"/>
      <inertia ixx="1.0" ixy="0.0" ixz="0.0" iyy="1.0" iyz="0.0" izz="1.0"/>
    </inertial>
    <visual>
      <origin rpy="0 0 0" xyz="0 0 0"/>
      <geometry>
        <mesh filename="package://robotino_description/meshes/RobotinoWheel.dae" scale="0.01 0.01 0.01"/>
      </geometry>
    </visual>
  </link>
  <joint name="wheel2_joint" type="continuous">
    <origin rpy="0 0 -1.04719666667" xyz="0.065 -0.11 0.04"/>
    <axis xyz="-1 0 0"/>
    <parent link="base_link"/>
    <child link="wheel2_link"/>
  </joint>
  <link name="wheel2_link">
    <inertial>
      <mass value="0.00001"/>
      <origin xyz="0 0 0"/>
      <inertia ixx="1.0" ixy="0.0" ixz="0.0" iyy="1.0" iyz="0.0" izz="1.0"/>
    </inertial>
    <visual>
      <origin rpy="0 0 0" xyz="0 0 0"/>
      <geometry>
        <mesh filename="package://robotino_description/meshes/RobotinoWheel.dae" scale="0.01 0.01 0.01"/>
      </geometry>
    </visual>
  </link>
  <joint name="command_bridge_joint" type="fixed">
    <origin ...
(more)