About ROS/Gazebo Simulator with SITL?

After so many days i started understanding about the whole pipeline and after fixing bugs that came during set up, today i just find out that the page (http://ardupilot.org/dev/docs/using-rosgazebo-simulator-with-sitl.html) has been removed and replaced with
(http://ardupilot.org/dev/docs/using-gazebo-simulator-with-sitl.html). Can someone please share the earlier page with me.

Hi,

You can find the old page here : https://github.com/ArduPilot/ardupilot_wiki/commit/72b367647cbcbf693fef3fa7d8463617d3d18479

Thanks,
Also there is some issue with Mavros
mavros/libmavconn/src/interface.cpp
The definition of function mavlink_finalize_channel doesn’t match with its function calls in ros/indigo/Mavlink
due to which it gives error

/home/mandeep/catkin_ws/src/mavros/libmavconn/src/interface.cpp:89:28: error: too few arguments to function ‘uint16_t mavlink_finalize_message_chan(mavlink_message_t*, uint8_t, uint8_t, uint8_t, uint8_t, uint8_t, uint8_t)’
mavlink_crcs[msg.msgid]);
In file included from /opt/ros/indigo/include/mavlink/v1.0/ardupilotmega/…/protocol.h:85:0,
from /opt/ros/indigo/include/mavlink/v1.0/ardupilotmega/ardupilotmega.h:30,
from /opt/ros/indigo/include/mavlink/v1.0/ardupilotmega/mavlink.h:33,
from /home/mandeep/catkin_ws/src/mavros/libmavconn/include/mavconn/mavlink_dialect.h:56,
from /home/mandeep/catkin_ws/src/mavros/libmavconn/include/mavconn/interface.h:38,
from /home/mandeep/catkin_ws/src/mavros/libmavconn/src/interface.cpp:22:
/opt/ros/indigo/include/mavlink/v1.0/ardupilotmega/…/mavlink_helpers.h:68:25: note: declared here
MAVLINK_HELPER uint16_t mavlink_finalize_message_chan(mavlink_message_t* msg, uint8_t system_id, uint8_t component_id,
^
make[2]: *** [mavros/libmavconn/CMakeFiles/mavconn.dir/src/interface.cpp.o] Error 1
make[1]: *** [mavros/libmavconn/CMakeFiles/mavconn.dir/all] Error 2
make[1]: *** Waiting for unfinished jobs…

It has taken lot of my time