Quantcast
Channel: ROS Answers: Open Source Q&A Forum - RSS feed
Viewing all 1516 articles
Browse latest View live

Bump Sensors on Simulated TurtletBot in kinetic

$
0
0
Can anyone get a reading from the bump sensors on a simulated turtlebot in Gazebo on kinetic? I have 4 terminals open. 1) $ roscore 2) $ roslaunch turtlebot_gazebo turtlebot_world.launch --run Gazebo simulation 3) $ rostopic pub -r 10 /mobile_base/commands/veloty geometry_msgs/Twist '{linear: {x:0.2}}' --move the turtlebot forward 4) $ rostopic echo /mobile_base/events/bumper --display any bumper messages When the bot runs into an obstacle, and the bump sensor should be pressed, I'm getting no output in terminal 4. Can anyone confirm a different result or explain why there aren't any bumper messages? I suspect this is not a problem on indigo. Thanks a lot. Rob

Can we do the modelling of PR2 Robot on ROS and then simulate it in gazebo?

$
0
0
I was wondering if i could do the complete modelling of PR2 on ROS and do the simulation of the same myself? is this possible? if yes then are there any tutorials available for this?

ros_control fails (couldn't find the expected controller_manager)

$
0
0
Hi! I am trying to run a custom **humanoid robot (foo) in Gazebo**. I have the urdf running correctly (in Rviz and Gazebo the robot spawns without problems. However i am not able of doing the correct set up of the control in Gazebo. **When the robot spawns it falls to the ground**. The only warning i have is the following: [WARN] Controller Spawner couldn't find the expected controller_manager ROS interface. So i suppose the problem is that the **control is not loaded**. I have searched for similar problems, and i have made sure that the plugin is correctly configured. The output of **rosservice list | grep controller_manager** is /foo/controller_manager/list_controllers /foo/controller_manager/load_controller /foo/controller_manager/reload_controller_libraries /foo/controller_manager/switch_controller /foo/controller_manager/unload_controller I have also checked the **namespaces**, but i can not see anything wrong. I have the following code for the spawn of the robot: The following for the control: I think all the stuff is loaded in the **foo namespace**. If any of you have any clue about why this could be happenning, you will be welcome. Thank you in advance! **UPDATE** Added the terminal info when lauching my simulation: ![image description](/upfiles/14563989687241589.png) Although it says ros_control is loaded there are no controllers spawned by the controller (no controller topics)

get a gazebo topic and publish in a ros topic

$
0
0
Hi, I have created a node in gazebo about logical camera so when i type gz topic -l in terminal. there is /gazebo/default/my_p3dx/base_link/logical_camera/models. and i want to use this values in ros.(When i type rostopic list in terminal, there ins't /gazebo/default/my_p3dx/base_link/logical_camera/models message) I guess that send from gazebo topic to ros topic, How can i do that?

Hi, I want to move my robot in a certain path. I have published the data from odometry. How can I use this data to move my robot in a certain path? I use gazebo to simulate

$
0
0
Hi, I want to move my robot in a certain path. I have published the data from odometry. How can I use this data to move my robot in a certain path? I use gazebo to simulate

Using tf data of geomagic touch to control schunk lwa3

$
0
0
Hi, I am trying to control schunk lwa 3 in gazebo using joint angles of geomagic touch. I can control lwa3 using commands from the terminal but to teleoperate I need to somehow map tf data of geomagic touch to lwa3. I dont know how to go about it. Is it possible to control lwa using omni keeping in mind difference in their configuration. I would be thankful if anyone could point out the steps to go about it.

Any quadrotor simulation package in ROS Kinetic?

$
0
0
Hi, I've been workiing with **quadrotor simulation in gazebo** and **ROS indigo** utilizing hector_quadrotor package. Now I have changed my ROS to **kinetic** and Ubuntu to **16.04.**
However, hector_quadrotor can be **no longer** utilized due to various compile erros. The main reason I find out is that gazebo 7 no longer support some old APIs which hector_quadrotor calls. I tried to solve these compilation problems but failed.
Could you please tell me some other simulation package available in ROS kinetic with gazebo? Thanks for your advice.

Publish on /My_robot/cmd_vel using teleop

$
0
0
Hello everyone, I am using the teleop package from the below link to publish on cmd_vel. Where do I have to make changes in the teleop cpp file in src if I want to publish on /My_robot/cmd_vel. https://github.com/ros-teleop/teleop_twist_joy Thanks.

Run gazebo on my network

$
0
0
Hello all, I want to launch my same robot simulation using gazebo on multiple computer on the LAN. The simulation has four robots and I want to have fixed camera view of each one on the respective computer. I am using ROS Indigo. Thanks.

How I can add laser to my diff drive robot in gazebo?

$
0
0
Hi everyone I am beginner in gazebo and ROS. I am trying to implement global path planner to get data from laser. For that purpose I need to know which laser sensor or sonar can help in this task. How I can integrate laser or sonar to my diff drive robot? Thanks in advance

Move_base actionlib goal doesn't change to SUCCEED

$
0
0
Hi all, I'm trying to made a random waypoints generator in ROS Indigo for my autonomous navigation simulator (made in Gazebo 2.2). The robot moves without problem within the map when i send them goal publishing /move_base_simple/goal or using the 2D nav goal features on Rviz, but i always get that the status of the goals is (for ex.) id: /move_base-3-1771.985000000 status: 1 text: This goal has been accepted by the simple action server and it doesn't change when the robot reaches the goal (it should be SUCCEED, so = 3). For my generator, at the beginning i'm using this code as test #include #include #include typedef actionlib::SimpleActionClient MoveBaseClient; int main(int argc, char** argv){ ros::init(argc, argv, "simple_navigation_goals"); MoveBaseClient ac("move_base", true); while(!ac.waitForServer(ros::Duration(5.0))){ ROS_INFO("Waiting for the move_base action server to come up"); } move_base_msgs::MoveBaseGoal goal; goal.target_pose.header.frame_id = "base_link"; goal.target_pose.header.stamp = ros::Time::now(); goal.target_pose.pose.position.x = 1.0; goal.target_pose.pose.orientation.w = 1.0; ROS_INFO("Sending goal"); ac.sendGoal(goal); ac.waitForResult(); if(ac.getState() == actionlib::SimpleClientGoalState::ACTIVE) ROS_INFO("Hooray, the base moved 1 meter forward"); else ROS_INFO("The base failed to move forward 1 meter for some reason"); return 0; } and, when i run it, the robot does 1 meter in front of it, but the goal status get stuck on 1 (ACTIVE). I've tried to find something within the ROS answer and someone suggests that it could be something related to the odom message where the vx and vy must be zero after the reaching of the goal, otherwise the navigation stack continues to adjust everything and the goal will never be reached: based on it I've seen that the odom topic coming from gazebo doesnt have the twist setted to zero when the robot reaches the goal...could it be the problem?? thanks in advance

gazebo_ros_vacuum_gripper not working as expected

$
0
0
Hello there, I am trying to use the gazebo_ros_vacuum_gripper plugin from gazebo_ros_pkgs in Jade. My URDF can be found [here](https://github.com/JoshMarino/QuadrupedModel/tree/master). Basically it is a box that starts out roughly 0.5 m above ground and then gravity pulls it downward. On the underside of my box, I have added a link/joint for the vacuum_gripper. I am able to turn the grasping service on and it notifies me on the topic `/Gecko_2/vacuum_gripper` that it is grasping. However, if I apply a body force in Gazebo that is just larger than the weight of the box, the box moves upward off the ground plane in Gazebo. When this occurs, the state of `/Gecko_2/vacuum_gripper` stays `True` (grasping). This should not happen from my understanding of the vacuum_gripper. Is there something I am doing wrong? I want to be able to extend this example to a walking robot in which each leg will be attached to the ground_plane through a vacuum_gripper. Any help would be appreciated, including going about this a different way. I looked into `gazebo/physics/gripper.cc`, but have not yet tried. It appears to create a `fixedJoint` between the gripper and the grasping object for a certain amount of time.

gazebo spawn_model from .py source code

$
0
0
env: Ubuntu 14.04, ROS Indigo. Is there a way to spawn models from the code? I was referring to [gazebo_msgs/SpawnModel.srv](http://docs.ros.org/kinetic/api/gazebo_msgs/html/srv/SpawnModel.html). Tried, #!/usr/bin/env python import rospy, tf from gazebo_msgs.srv import DeleteModel, SpawnModel from geometry_msgs.msg import * if __name__ == '__main__': print("Waiting for gazebo services...") rospy.init_node("spawn_products_in_bins") rospy.wait_for_service("gazebo/delete_model") rospy.wait_for_service("gazebo/spawn_model") print("Got it.") delete_model = rospy.ServicePoxy("gazebo/delete_model", DeleteModel) spawn_model = rospy.ServiceProxy("gazebo/spawn_model", SpawnModel) with open("$GAZEBO_MODEL_PATH/product_0/model.sdf", "r") as f: product_xml = f.read() orient = Quaternion(tf.transformations.quaternion_from_euler(0,0,0)) for num in xrange(0,12): item_name = "product_{0}_0".format(num) print("Deleting model:%s", item_name) delete_model(item_name) for num in xrange(0,12): bin_y = 2.8 * (num / 6) - 1.4 bin_x = 0.5 * (num % 6) - 1.5 item_name = "product_{0}_0".format(num) print("Spawning model:%s", item_name) item_pose = Pose(Point(x=bin_x, y=bin_y, z=2), orient) spawn_model(item_name, product_xml, "", item_pose, "world") But the services never start, josh@jUbuntu:~/ros/stockroom_ws$ rosrun stock_bot spawn_products_in_bins.py Waiting for gazebo services... Could not find any topics with `/gazebo/spawn_model` or `/gazebo/delete_model` even with `rostopic list` PS: I'm running a gazebo simulation during the whole time.

Getting contact sensor/bumper Gazebo plugin to work

$
0
0
Has anyone had success with this? That is, creating a contact sensor/ bumper in urdf and connecting it to the Gazebo plugin described here (http://gazebosim.org/tutorials?tut=ros_gzplugins#Bumper), and then receiving the messages you'd expect on the defined topic. My Gazebo code is: truetrue15.0Gazebo/Redbump_sensor_collisionbumper_valsworld The model code is I don't think there is anything wrong with above. The topic bumper_vals is created and I can look at the messages to it via rostopic echo. They are in the expected gazebo_msgs/ContactState format. (or is it ContactsState?) The point is that the states[] array is always empty even on an obvious collision. Heaps of people seem to have had problems with bumpers (especially in simulation) and I don't see any clear cut answer. Why isn't there an effort to get this to work? If you know anything about robotics, then a contact sensor is the most basic thing you need to have working. Cameras, laser sensors re great, but the contact sensor is (should be) the simple, reliable backup that gets you out of trouble. And you can do a lot with it alone - e.g investigate and test path planning algorithms in spaces with obstacles, which is my project. Any help greatly appreciated. Rob

Husky perfect localization (Gazebo Positioning System)

$
0
0
Hey folks, I've got a Husky in a Gazebo world that's been generated from an existing floor plan. The floor plan is also published using map_server. For my purposes right now, it's fine if the robot is perfectly localized in Gazebo and I was planning on using /gazebo/model_states to set the required transformations of the robot so that the map in RVIZ stays fixed and doesn't slide when the robot runs up against walls. I'm still figuring out ROS, so I'm not sure what exactly would be needed for that. In RVIZ the map visualization tells me there's an error saying that "No transform from [map] to [odom]" but to be honest I'm not sure what this transformation would entail for the Husky. I really appreciate any help with this. Thanks!

How to get laser data in gazebo?

$
0
0
Hi everyone I have created my diff drive robot and also mounted laser on the robot using Hokuyo model. Now I need to move my robot from start position to the goal position. I can't understand how to do this. Please help I am beginner. Thanks in advance

How to move rbcar in Gazebo simulation

$
0
0
Hello, I am trying to use the **rbcar_common** and **rbcar_sim** (http://wiki.ros.org/rbcar_sim?distro=indigo) packages to get an rbcar robot to move in Gazebo. The robot uses the **skid_steering_plugin** according to the wiki. I'm new to ROS and I am finding it hard to realize how to publish topics that will make this robot move. `roslaunch rbcar_gazebo rbcar.launch` opens the model in Gazebo and it looks ok. I have then tried all the lauch files in rbcar_navigation but none of them have worked. In particular when I run: roslaunch rbcar_navigation move_base_amcl.launch I get NODES / amcl (amcl/amcl) map_server (map_server/map_server) move_base (move_base/move_base) rviz (rviz/rviz) ROS_MASTER_URI=http://localhost:11311 core service [/rosout] found process[map_server-1]: started with pid [6166] process[amcl-2]: started with pid [6167] process[move_base-3]: started with pid [6168] process[rviz-4]: started with pid [6190] [ INFO] [1477589354.751377650]: Requesting the map... [ INFO] [1477589354.769636127]: Received a 2432 X 2272 map @ 0.050 m/pix [ INFO] [1477589354.846352822]: Initializing likelihood field model; this can take some time on large maps... [ WARN] [1477589354.893053667, 9.535000000]: Timed out waiting for transform from base_footprint to map to become available before running costmap, tf error: . canTransform returned after 9.535 timeout was 0.1. [ INFO] [1477589355.146714273, 9.789000000]: Done initializing likelihood field model. [ WARN] [1477589359.944013281, 14.577000000]: Timed out waiting for transform from base_footprint to map to become available before running costmap, tf error: . canTransform returned after 0.102 timeout was 0.1. [ WARN] [1477589364.988898232, 19.614000000]: Timed out waiting for transform from base_footprint to map to become available before running costmap, tf error: . canTransform returned after 0.101 timeout was 0.1. [ WARN] [1477589370.043614880, 24.660000000]: Timed out waiting for transform from base_footprint to map to become available before running costmap, tf error: . canTransform returned after 0.1 timeout was 0.1. [ WARN] [1477589370.248725939, 24.864000000]: No laser scan received (and thus no pose updates have been published) for 24.864000 seconds. Verify that data is being published on the /scan_filtered topic. [ WARN] [1477589375.087841805, 29.696000000]: Timed out waiting for transform from base_footprint to map to become available before running costmap, tf error: . canTransform returned after 0.1 timeout was 0.1. [ WARN] [1477589380.132100474, 34.732000000]: Timed out waiting for transform from base_footprint to map to become available before running costmap, tf error: . canTransform returned after 0.1 timeout was 0.1. [ WARN] [1477589385.183140865, 39.772000000]: Timed out waiting for transform from base_footprint to map to become available before running costmap, tf error: . canTransform returned after 0.102 timeout was 0.1. [ WARN] [1477589385.275841157, 39.864000000]: No laser scan received (and thus no pose updates have been published) for 39.864000 seconds. Verify that data is being published on the /scan_filtered topic. [ WARN] [1477589390.231475400, 44.812000000]: Timed out waiting for transform from base_footprint to map to become available before running costmap, tf error: . canTransform returned after 0.1 timeout was 0.1. [ WARN] [1477589395.276557064, 49.850000000]: Timed out waiting for transform from base_footprint to map to become available before running costmap, tf error: . canTransform returned after 0.102 timeout was 0.1. [ WARN] [1477589400.298716834, 54.864000000]: No laser scan received (and thus no pose updates have been published) for 54.864000 seconds. Verify that data is being published on the /scan_filtered topic. [ WARN] [1477589400.328388364, 54.893000000]: Timed out waiting for transform from base_footprint to map to become available before running costmap, tf error: . canTransform returned after 0.101 timeout was 0.1. [ WARN] [1477589405.371570178, 59.925000000]: Timed out waiting for transform from base_footprint to map to become available before running costmap, tf error: . canTransform returned after 0.101 timeout was 0.1. [ WARN] [1477589410.416952335, 64.961000000]: Timed out waiting for transform from base_footprint to map to become available before running costmap, tf error: . canTransform returned after 0.101 timeout was 0.1. [ WARN] [1477589415.328551497, 69.864000000]: No laser scan received (and thus no pose updates have been published) for 69.864000 seconds. Verify that data is being published on the /scan_filtered topic. The last WARN is constantly repeated. **Rviz** GUI opens and loads a map but when I try to move the robot using **2D Nav Goals** nothing happens. I have also tried using the robotnik_test_robot package from https://github.com/RobotnikAutomation/robotnik_test_robot , particularly the test_square test, but if I run roslaunch rbcar_gazebo rbcar.launch rosrun robotnik_test_robot_test_square test_square I just get [ INFO] [1477588744.896274122, 369.092000000]: Waiting for the move_base action server to come up I'm working on ROS Indigo in Xubuntu 14.04 with Gazebo 2.2.6. The output after running `roslaunch rbcar_gazebo rbcar.launch` is ... logging to /home/ccorti/.ros/log/936e035e-9c68-11e6-bf11-28b2bd1f4b18/roslaunch-ccorti-ThinkPad-W540-2948.log Checking log directory for disk usage. This may take awhile. Press Ctrl-C to interrupt Done checking log file disk usage. Usage is <1GB. started roslaunch server http://ccorti-ThinkPad-W540:34140/ SUMMARY ======== PARAMETERS * /rbcar/joint_read_state_controller/publish_rate: 100.0 * /rbcar/joint_read_state_controller/type: joint_state_contr... * /rbcar/left_front_axle_controller/joint: left_front_axle * /rbcar/left_front_axle_controller/pid/d: 750.0 * /rbcar/left_front_axle_controller/pid/i: 100.0 * /rbcar/left_front_axle_controller/pid/p: 1500.0 * /rbcar/left_front_axle_controller/type: velocity_controll... * /rbcar/left_front_shock_controller/joint: left_front_shock * /rbcar/left_front_shock_controller/pid/d: 100.0 * /rbcar/left_front_shock_controller/pid/i: 10.0 * /rbcar/left_front_shock_controller/pid/p: 500.0 * /rbcar/left_front_shock_controller/type: effort_controller... * /rbcar/left_rear_axle_controller/joint: left_rear_axle * /rbcar/left_rear_axle_controller/pid/d: 750.0 * /rbcar/left_rear_axle_controller/pid/i: 100.0 * /rbcar/left_rear_axle_controller/pid/p: 1500.0 * /rbcar/left_rear_axle_controller/type: velocity_controll... * /rbcar/left_rear_shock_controller/joint: left_rear_shock * /rbcar/left_rear_shock_controller/pid/d: 100.0 * /rbcar/left_rear_shock_controller/pid/i: 10.0 * /rbcar/left_rear_shock_controller/pid/p: 500.0 * /rbcar/left_rear_shock_controller/type: effort_controller... * /rbcar/left_steering_joint_controller/joint: left_steering_joint * /rbcar/left_steering_joint_controller/pid/d: 100.0 * /rbcar/left_steering_joint_controller/pid/i: 10.0 * /rbcar/left_steering_joint_controller/pid/p: 500.0 * /rbcar/left_steering_joint_controller/type: effort_controller... * /rbcar/right_front_axle_controller/joint: right_front_axle * /rbcar/right_front_axle_controller/pid/d: 750.0 * /rbcar/right_front_axle_controller/pid/i: 100.0 * /rbcar/right_front_axle_controller/pid/p: 1500.0 * /rbcar/right_front_axle_controller/type: velocity_controll... * /rbcar/right_front_shock_controller/joint: right_front_shock * /rbcar/right_front_shock_controller/pid/d: 500.0 * /rbcar/right_front_shock_controller/pid/i: 10.0 * /rbcar/right_front_shock_controller/pid/p: 500.0 * /rbcar/right_front_shock_controller/type: effort_controller... * /rbcar/right_rear_axle_controller/joint: right_rear_axle * /rbcar/right_rear_axle_controller/pid/d: 750.0 * /rbcar/right_rear_axle_controller/pid/i: 100.0 * /rbcar/right_rear_axle_controller/pid/p: 1500.0 * /rbcar/right_rear_axle_controller/type: velocity_controll... * /rbcar/right_rear_shock_controller/joint: right_rear_shock * /rbcar/right_rear_shock_controller/pid/d: 100.0 * /rbcar/right_rear_shock_controller/pid/i: 10.0 * /rbcar/right_rear_shock_controller/pid/p: 500.0 * /rbcar/right_rear_shock_controller/type: effort_controller... * /rbcar/right_steering_joint_controller/joint: right_steering_joint * /rbcar/right_steering_joint_controller/pid/d: 100.0 * /rbcar/right_steering_joint_controller/pid/i: 10.0 * /rbcar/right_steering_joint_controller/pid/p: 500.0 * /rbcar/right_steering_joint_controller/type: effort_controller... * /robot_description: , set to "" Error [Param.cc:181] Unable to set value [1,0471975511965976] for key[horizontal_fov] Error [Param.cc:181] Unable to set value [0,100000001] for key[near] [ INFO] [1477588374.185384540, 0.160000000]: Block laser plugin missing , defaults to 0.0 [ INFO] [1477588374.185427091, 0.160000000]: Block laser plugin missing , defaults to 101 [ INFO] [1477588374.185444361, 0.160000000]: INFO: gazebo_ros_laser plugin should set minimum intensity to 101.000000 due to cutoff in hokuyo filters. [ INFO] [1477588374.185458216, 0.160000000]: Block laser plugin missing , defaults to 0 [ INFO] [1477588374.897664118, 0.160000000]: Laser Plugin (robotNamespace = /), Info: Using the 'robotNamespace' param: '/' [ INFO] [1477588374.897804858, 0.160000000]: Starting Laser Plugin (ns = /)! [ INFO] [1477588374.898917831, 0.160000000]: Laser Plugin (ns = /) , set to "" [ INFO] [1477588374.913353292, 0.160000000]: Physics dynamic reconfigure ready. Unhandled exception in thread started by sys.excepthook is missing lost sys.stderr [ INFO] [1477588375.048551749, 0.160000000]: Loading gazebo_ros_control plugin [ INFO] [1477588375.048702211, 0.160000000]: Starting gazebo_ros_control plugin in namespace: /rbcar [ INFO] [1477588375.049511692, 0.160000000]: gazebo_ros_control plugin is waiting for model URDF in parameter [/robot_description] on the ROS param server. [spawn_urdf-7] process has finished cleanly log file: /home/ccorti/.ros/log/936e035e-9c68-11e6-bf11-28b2bd1f4b18/spawn_urdf-7*.log [ INFO] [1477588375.214805325, 0.160000000]: Loaded gazebo_ros_control. [INFO] [WallTime: 1477588375.321397] [0.202000] Controller Spawner: Waiting for service /rbcar/controller_manager/switch_controller [INFO] [WallTime: 1477588375.322630] [0.203000] Controller Spawner: Waiting for service /rbcar/controller_manager/unload_controller [INFO] [WallTime: 1477588375.323750] [0.204000] Loading controller: left_front_shock_controller [INFO] [WallTime: 1477588375.375247] [0.246000] Loading controller: left_steering_joint_controller [INFO] [WallTime: 1477588375.402927] [0.274000] Loading controller: left_front_axle_controller [INFO] [WallTime: 1477588375.452634] [0.314000] Loading controller: right_front_shock_controller [INFO] [WallTime: 1477588375.458429] [0.320000] Loading controller: right_steering_joint_controller [INFO] [WallTime: 1477588375.484925] [0.346000] Loading controller: right_front_axle_controller [INFO] [WallTime: 1477588375.490851] [0.352000] Loading controller: left_rear_shock_controller [INFO] [WallTime: 1477588375.496908] [0.358000] Loading controller: left_rear_axle_controller [INFO] [WallTime: 1477588375.501747] [0.363000] Loading controller: right_rear_shock_controller [INFO] [WallTime: 1477588375.506747] [0.368000] Loading controller: right_rear_axle_controller [INFO] [WallTime: 1477588375.511885] [0.373000] Loading controller: joint_read_state_controller [INFO] [WallTime: 1477588375.561591] [0.413000] Controller Spawner: Loaded controllers: left_front_shock_controller, left_steering_joint_controller, left_front_axle_controller, right_front_shock_controller, right_steering_joint_controller, right_front_axle_controller, left_rear_shock_controller, left_rear_axle_controller, right_rear_shock_controller, right_rear_axle_controller, joint_read_state_controller [INFO] [WallTime: 1477588375.564644] [0.416000] Started controllers: left_front_shock_controller, left_steering_joint_controller, left_front_axle_controller, right_front_shock_controller, right_steering_joint_controller, right_front_axle_controller, left_rear_shock_controller, left_rear_axle_controller, right_rear_shock_controller, right_rear_axle_controller, joint_read_state_controller Any ideas on how I can get any of these options to work? Or how to publish a topic with rostopic that will get the robot to move in the simulation? Thank you very much for your help!

Cannot spawn a model in Gazebo

$
0
0
I've been trying to spawn a robot model in Gazebo after successfully converted from .xacro to .urdf. But when I tried to spawn the robot with terminal command, it gave me this error nuttaworn@nuttaworn-Lenovo-Z50-70:~/valkyrie_ws/src/val_description/model/robots$ rosrun gazebo_ros spawn_model -file 'rospack find val_description'/model/robots/valkyrie_sim.urdf -urdf -z 1 -model valkyrie spawn_model script started [INFO] [WallTime: 1477593321.260120] [0.000000] Loading model xml from file Error: file does not exist rospack find val_description/model/robots/valkyrie_sim.urdf I checked the path to the urdf file and it's the exact path. I tried finding the package with `rospack` and it located the package without any problem. Can somebody point out what I missed? Thank you.

Robot formation in Gazebo

$
0
0
Hello Everyone, I was able to spawn three robots in gazebo and want them to move in a formation like a peleton. The robots are spawned at different locations at the start. I am new to the ROS and gazebo environment, can someone suggest me how to implement this.. Thanks in advance.

Unable to find ros-indigo-gazebo7-ros-pkgs

$
0
0
I have just installed ROS Indigo, along with Gazebo 7 from the separate Gazebo site. According to this page, [Using a specific Gazebo version with ROS](http://gazebosim.org/tutorials/?tut=ros_wrapper_versions#UsingaspecificGazeboversionwithROS), I should be able to install ros-pkgs from Debian with (I believe) the following name: `ros-indigo-gazebo7-ros-pkgs`. However, I cannot find this package. I believe I already added the OSR Foundation packages, but perhaps I did not do it correctly. I have http://packages.osrfoundation.org/gazebo/ubuntu-stable trust main in my repository list (I am running Ubuntu trusty). Can someone tell me what I am doing wrong, or where this package is located?
Viewing all 1516 articles
Browse latest View live


<script src="https://jsc.adskeeper.com/r/s/rssing.com.1596347.js" async> </script>