Hi Ken,<div><br></div><div>Thanks for the information. For now, I'll stick to just using the ns attribute on <node> and <group>. But I'll watch in the future for rospy updates that would enable this.</div>

<div><br></div><div>
Thanks again!</div><div><br></div><div>Mike</div><div><br></div><div><br></div><div><br></div><div><div class="gmail_quote">On 27 January 2011 12:20, Ken Conley <span dir="ltr"><<a href="mailto:kwc@willowgarage.com" target="_blank">kwc@willowgarage.com</a>></span> wrote:<br>



<blockquote class="gmail_quote" style="margin:0 0 0 .8ex;border-left:1px #ccc solid;padding-left:1ex">I should add, rospy exposes the name library in a more raw way:<br>
<br>
<a href="http://www.ros.org/wiki/rospy/Overview/Names%20and%20Node%20Information" target="_blank">http://www.ros.org/wiki/rospy/Overview/Names%20and%20Node%20Information</a><br>
<br>
You can use it to construct this behavior, but it is not as elegant as<br>
NodeHandles.<br>
<font color="#888888"><br>
 - Ken<br>
</font><div><div></div><div><br>
On Thu, Jan 27, 2011 at 9:19 AM, Ken Conley <<a href="mailto:kwc@willowgarage.com" target="_blank">kwc@willowgarage.com</a>> wrote:<br>
> Hi Mike,<br>
><br>
> rospy doesn't have this ability yet.<br>
><br>
>  - Ken<br>
><br>
> On Wed, Jan 26, 2011 at 10:45 AM, Mike Purvis<br>
> <<a href="mailto:mpurvis@clearpathrobotics.com" target="_blank">mpurvis@clearpathrobotics.com</a>> wrote:<br>
>> Hey all,<br>
>> Comparing rospy and roscpp, it looks like roscpp provides for the ability to<br>
>> set a default namespace using the NodeHandle constructor, as done in mux:<br>
>><br>
>>   // Put our API into the "mux" namespace, which the user should usually<br>
>> remap<br>
>>   ros::NodeHandle mux_nh("mux");<br>
>>   // Latched publisher for selected input topic name<br>
>>   g_pub_selected = mux_nh.advertise<std_msgs::String>(string("selected"), 1,<br>
>> true);<br>
>>   // Backward compatibility<br>
>>   ros::ServiceServer ss = n.advertiseService(g_output_topic +<br>
>> string("_select"), sel_srv_cb_dep);<br>
>>   // New service<br>
>>   ros::ServiceServer ss_select = mux_nh.advertiseService(string("select"),<br>
>> sel_srv_cb);<br>
>>   (etc)<br>
>><br>
>> Is there a way to achieve this in rospy? Would you just do it using the argv<br>
>> parameter to init_node, or is there some better way?<br>
>> Thanks,<br>
>> Mike<br>
>> _______________________________________________<br>
>> ros-users mailing list<br>
>> <a href="mailto:ros-users@code.ros.org" target="_blank">ros-users@code.ros.org</a><br>
>> <a href="https://code.ros.org/mailman/listinfo/ros-users" target="_blank">https://code.ros.org/mailman/listinfo/ros-users</a><br>
>><br>
>><br>
><br>
_______________________________________________<br>
ros-users mailing list<br>
<a href="mailto:ros-users@code.ros.org" target="_blank">ros-users@code.ros.org</a><br>
<a href="https://code.ros.org/mailman/listinfo/ros-users" target="_blank">https://code.ros.org/mailman/listinfo/ros-users</a><br>
</div></div></blockquote></div><br></div>